#include <ros/ros.h>
#include <geometry_msgs/Twist.h>
#include <sensor_msgs/Joy.h>
#include <rsm_msgs/OperationMode.h>
#include <rsm_msgs/SetOperationMode.h>
Go to the source code of this file.
|
class | rsm::RobotControlMux |
| Handles all command velocities and only allows the robot to move at all if no emergency stop is set and only move autonomous if autonomous operation is active. More...
|
|
Threshold for minimal movement of joysticks to be recognized as and intended command
Definition at line 13 of file RobotControlMux.h.