Show EOL distros:
rr_openrover_stack: rr_control_input_manager | rr_openrover_description | rr_openrover_driver | rr_openrover_driver_msgs | rr_openrover_simulation | rr_rover_zero_driver
Package Summary
Released
Documented
The rover_zero_driver package
- Maintainer status: maintained
- Maintainer: nickp <nickp AT todo DOT todo>
- Author:
- License: BSD
- Source: git https://github.com/RoverRobotics/rr_openrover_stack.git (branch: kinetic-devel)
rr_openrover_stack: rr_control_input_manager | rr_openrover_description | rr_openrover_driver | rr_openrover_driver_msgs | rr_openrover_simulation | rr_rover_zero_driver
Package Summary
Released
Documented
The rover_zero_driver package
- Maintainer status: developed
- Maintainer: John Bartholomew <john AT roverrobotics DOT com>
- Author:
- License: BSD
- Source: git https://github.com/RoverRobotics/rr_openrover_stack.git (branch: melodic-devel)
Description
This code is for those working with the Rover Robotics Rover Zero V1.
The Rover Zero V1 uses the RoboClaw 2x15 motor controller which communicates via USB.
This package abstracts away the USB communications and allows users to quickly get their robots moving around and doing cool things!
Nodes
rr_roverzero_driver
This package serves as a ROS driver for a Rover Robotics Rover Zero Driver which communicates via UART to a host PC running ROS. This package assumes users are using a USB cable.Subscribed Topics
/cmd_vel (geometry_msgs/Twist)- A topic that controls the linear (m/s) and angular (rad/s) velocity of the robot. cmd_vel/managed should come from a package that can manage multiple sources of control (local joystick, remote keyboard, move_base, etc...) like rr_control_manager. If only one source of input is needed then this can be remapped to cmd_vel.
- When set to True the driver will ignore all input commands until the True message is received on the /rr_openrover_driver/soft_estop/reset topic (even if False is published to this topic). This is very useful to map to a button on a controller. If activated while using the ROS nav stack it acts as a pause button and autonomy can easily be resumed if the estop is reset before your navigation stack timeouts kick in.
- Used to reset the soft_estop. This is also useful to map to a button on a controller
Published Topics
diagnostics (<<MsgLink: execution failed [string index out of range] (see also the log)>>)- diagnostics settings for roboclaw.
- Encoder-based odometry
Parameters
address (int, default: 128)- Roboclaw communication address
- commuincation baudrate
- software cap on robot's velocity
- software cap on robot's turnrate
- coeficient used to convert speed to duty cycle
- diagnostic frequency
- motor cmd frequency
- odometry frequency
- roboclaw communication timeout
- enable to publish odometry data to ros
- Enable to turn on PID with current PID settings. Will ignore PID values from PID parameters
- Overwrite Hardware PID values with the one from PID parameters
- save changes to motor controller
- Motor 1 Velocity P
- Motor 1 Velocity I
- Motor 1 Velocity D
- Motor 1 Maximum Possible Speed*
- Motor 2 Velocity P
- Motor 2 Velocity I
- Motor 2 Velocity D
- Motor 2 Maximum Possible Speed
- Encoder Tick Per Revolution
- Motor 1 Max Current Setting
- Motor 2 Max Current Setting
- Active brake timeout
- Robot TF Frame for Odometry
- Robot TF Frame for Base Link
- Distance between center of wheels
- Radius of wheel