Only released in EOL distros:
segwayrmp: rmp_base | rmp_description | rmp_msgs | rmp_teleop
Package Summary
Released
Documented
The rmp_teleop package provides teleoperation functionalities for a Segway Robotics Mobility Platform. This package currently supports the xbox wireless joytsick.
- Maintainer status: maintained
- Maintainer: Thomas de Candia <thomas.decandia AT sri DOT com>
- Author:
- License: Private
- Source: git https://github.com/sri-robotics/segwayrmp.git (branch: hydro)
Contents
Overview
The rmp_teleop package provides teleoperation functionalities for a Segway Robotics Mobility Platform.
This package currently supports the xbox wireless joytsick.
Quick Start
$ roslaunch rmp_teleop joystick.launch
Node
joy_node
Modified version of joy (http://wiki.ros.org/joy). The node won't publish any messages if no event is received within a certain period.rmp_teleop_node
ros interface to control a Segway RMP 440LE.Subscribed Topics
/rmp440le/joy (sensor_msgs/Joy)- joystick messages
Published Topics
/rmp440le/base/vel_cmd (geometry_msgs/TwistStamped)- velocity command
- deadman
- audio command
Parameters
joy_topic (string, default: rmp440le/joy)- joystick topic
- velocity command topic
- deadman topic
- audio command topic
- process update rate
- translational veolicty scale
- rotational velocity scale
- translational veolicty boost scale
- rotational velocity boost scale
Controller Usage
https://github.com/sri-robotics/segwayrmp/blob/master/rmp_teleop/xbox_controller_usage.pdf