ros2 / teleop_twist_joy

Simple joystick teleop for twist robots
Other
56 stars 74 forks source link

ros2/teleop_twist_joy

Overview

The purpose of this package is to provide a generic facility for tele-operating Twist-based ROS 2 robots with a standard joystick. It converts joy messages to velocity commands.

This node provides no rate limiting or autorepeat functionality. It is expected that you take advantage of the features built into joy for this.

Executables

The package comes with the teleop_node that republishes sensor_msgs/msg/Joy messages as scaled geometry_msgs/msg/Twist messages. The message type can be changed to geometry_msgs/msg/TwistStamped by the publish_stamped_twist parameter.

Subscribed Topics

Published Topics

Parameters

Usage

Install

For most users building from source will not be required, execute apt-get install ros-<rosdistro>-teleop-twist-joy to install.

Run

A launch file has been provided which has three arguments which can be changed in the terminal or via your own launch file. To configure the node to match your joystick a config file can be used. There are several common ones provided in this package (atk3, ps3-holonomic, ps3, xbox, xd3), located here: https://github.com/ros2/teleop_twist_joy/tree/rolling/config.

PS3 is default, to run for another config (e.g. xbox) use this:

ros2 launch teleop_twist_joy teleop-launch.py joy_config:='xbox'

Note: this launch file also launches the joy node so do not run it separately.

Arguments