[Documentation] [TitleIndex] [WordIndex

Description

ROS Drivers for the Stingbot and Traxbot Robots, developed at MRL-ISR-UC.
Note: This package depends on cereal_port from the serial_communication stack.

ROS driver


Nodes: stingbot_node / traxbot_node

Similar Arduino-based drivers for the Stingbot and Traxbot robots. The difference between the two nodes resides in robot specific parameters.

Usage

rosrun mrl_robots_drivers stingbot_node [serial_port]

rosrun mrl_robots_drivers traxbot_node [serial_port]

The optional parameter serial_port defines the serial port to communicate with the Arduino Board (Default: /dev/ttyACM0).

Subscribed topics

cmd_vel (geometry_msgs/Twist)

Published Topics

odom (nav_msgs/Odometry)

xbee (std_msgs/String)

sonars (std_msgs/Float32MultiArray)

tf transforms provided

odombase_link


2024-06-15 12:58