AdditionsServiceProviderNode.cpp
Go to the documentation of this file.
1 #include "ros/ros.h"
2 
4 
6 
8  service_provider->publishTopics();
9 }
10 int main(int argc, char **argv) {
11  ros::init(argc, argv, "additionsServiceProvider");
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  service_provider.reset(
19  ros::spin();
20  service_provider.reset();
21  return 0;
22 }
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
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)
Class that establishes communication between the different states and the RSM's periphery including t...
boost::shared_ptr< rsm::AdditionsServiceProvider > service_provider
void loopCallback(const ros::TimerEvent &)


rsm_additions
Author(s): Marco Steinbrink
autogenerated on Tue Mar 16 2021 02:44:35