1 #ifndef ROBOTCONTROLMUX_H_ 2 #define ROBOTCONTROLMUX_H_ 5 #include <geometry_msgs/Twist.h> 6 #include <sensor_msgs/Joy.h> 7 #include <rsm_msgs/OperationMode.h> 8 #include <rsm_msgs/SetOperationMode.h> 13 #define MOVE_THRESH 0.05 100 const geometry_msgs::Twist::ConstPtr& cmd_vel);
118 rsm_msgs::SetOperationMode::Response &res);
ros::Publisher _cmd_vel_pub
void teleoperationIdleTimerCallback(const ros::TimerEvent &event)
std::string _joystick_topic
ros::ServiceServer _set_operation_mode_service
bool checkJoystickCommand(const sensor_msgs::Joy::ConstPtr &joy)
ros::Publisher _operation_mode_pub
Handles all command velocities and only allows the robot to move at all if no emergency stop is set a...
geometry_msgs::Twist _teleoperation_cmd_vel
double _teleoperation_idle_timer_duration
std::string _teleoperation_cmd_vel_topic
ros::Subscriber _teleoperation_cmd_vel_sub
bool setOperationMode(rsm_msgs::SetOperationMode::Request &req, rsm_msgs::SetOperationMode::Response &res)
ros::Timer _teleoperation_idle_timer
sensor_msgs::Joy _joystick_cmd
void joystickCallback(const sensor_msgs::Joy::ConstPtr &joy)
void teleoperationCmdVelCallback(const geometry_msgs::Twist::ConstPtr &cmd_vel)
void autonomyCmdVelCallback(const geometry_msgs::Twist::ConstPtr &cmd_vel)
ros::Subscriber _autonomy_cmd_vel_sub
std::string _cmd_vel_topic
std::string _autonomy_operation_cmd_vel_topic
ros::Subscriber _joystick_sub
bool _emergency_stop_active
void publishOperationMode()
geometry_msgs::Twist _autonomy_cmd_vel