RobotControlMuxNode.cpp
Go to the documentation of this file.
1 #include "ros/ros.h"
3 
5 
7  robot_control_mux->publishTopics();
8 }
9 
10 int main(int argc, char **argv) {
11  ros::init(argc, argv, "robotControlMuxNode");
12  ros::NodeHandle private_nh("~");
13  double loop_rate;
14  private_nh.param("update_frequency", loop_rate, 20.0);
15  ros::Timer loop_timer = private_nh.createTimer(ros::Duration(1 / loop_rate),
16  loopCallback);
17  robot_control_mux.reset(new rsm::RobotControlMux());
18  ros::spin();
19  robot_control_mux.reset();
20  return 0;
21 }
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
void loopCallback(const ros::TimerEvent &)
Handles all command velocities and only allows the robot to move at all if no emergency stop is set a...
boost::shared_ptr< rsm::RobotControlMux > robot_control_mux
ROSCPP_DECL void spin(Spinner &spinner)
bool param(const std::string &param_name, T &param_val, const T &default_val) const
Timer createTimer(Rate r, Handler h, Obj o, bool oneshot=false, bool autostart=true) const
int main(int argc, char **argv)


rsm_core
Author(s): Marco Steinbrink
autogenerated on Tue Mar 16 2021 02:44:31