Only released in EOL distros:
Package Summary
ROS driver for the MetraLabs Scitos G5 mobile robot using the MetraLabs ABI. Optionally a Schunk manipulator can be controlled.
- Author: Yianni Gatsoulis and Chris Burbridge and Lorenzo Riano and Felix Kolbe
- License: GPL
- Source: git https://github.com/felix-kolbe/scitos_metralabs.git (branch: None)
Package Summary
ROS driver for the MetraLabs Scitos G5 mobile robot using the MetraLabs ABI. Optionally a Schunk manipulator can be controlled.
- Author: Yianni Gatsoulis and Chris Burbridge and Lorenzo Riano and Felix Kolbe
- License: GPL
- Source: git https://github.com/felix-kolbe/scitos_metralabs.git (branch: master)
Contents
Documentation
This package contains a driver that integrates MetraLabs Scitos G5 robots into ROS using MetraLabs' former MLRobotic libraries.
If your Scitos is newer and only runs "MIRA" try scitos_drivers or cognidrive_ros
Features
URDF model included
diagnostics support (atm. just the battery state)
access Scitos hardware features via dynamic_reconfigure (EBC ports, sonar, display led, free run mode...)
publish sonar data as Range message with automatic sonar (de)activation when nodes (un)subscribe (to disable sonar remove the <sonar> tag from the scitos-config-xml)
- bumper status / reset supported via topics
- ...
A manipulator supported by MetraLabs can be controlled via this node.
Supported protocols: AmtecMotionProtocol and SchunkMotionProtocol
- Each specific manipulator hardware can adjust its specifics via subclassing
- joint naming freedom
- mimicking joints support
FollowJointTrajectoryAction server
- ...
Feel free to ask for improvements or file issues.
Node API
ScitosServer node
The driver for the Scitos robot platform.Subscribed Topics
/cmd_vel (geometry_msgs/Twist)- drive the robot
- reset the bumper
Published Topics
/odom (nav_msgs/Odometry)- odometry from Scitos platform
- bumper status
- sonar data
- diagnostics, see features list
Parameters
~scitos_config_file (string, default: /opt/MetraLabs/MLRobotic/etc/config/SCITOS-G5_without_Head_config.xml)- SCITOS config file to use
- Which RobotArm class to load if not None (just an ID, no real classloader yet)
Dynamically Reconfigurable Parameters
See the dynamic_reconfigure package for details on dynamically reconfigurable parameters.- Enable power output
- Enable power output
- Enable power output
- Enable power output
- Enable power output
- Enable power output
- Disable brakes to push the robot
- Enable sonar
- Lock display knob
- Switch display status LED
Provided tf Transforms
base_link → odom- odometry transform
- transform for each sonar sensor
ScitosServer:manipulator
The manipulator part actually cannot be made a separate node. But it can be disabled if not needed and therefore this list is split.Subscribed Topics
/joint_states (sensor_msgs/JointState)- current joint states
- current joint status data
- emergency halt the manipulator
- soft stop the manipulator
- ack/reset the joint with given index
- ack/reset the manipulator
- set velocity for one joint
- set acceleration for one joint
- set current for one joint
- sets maximum current of all joints to their maximum, if supported
- move one joint to position
- move one joint with velocity
- move manipulator to position
- move manipulator with velocity
- move manipulator according to trajectory (Deprecated, use action instead)
- move manipulator according to trajectory action; the name can be parameterized
Published Topics
schunk/trajectory_state (control_msgs/JointTrajectoryControllerState)- the state information published by the old trajectory executor
Parameters
follow_joint_trajectory_action_name (string, default: follow_joint_trajectory)- The name to for this node's FollowJointTrajectoryAction server (will be prefixed with namespace schunk)