ServiceProviderNode.cpp
Go to the documentation of this file.
1 #include "ros/ros.h"
3 
5 
7  service_provider->publishTopics();
8 }
9 int main(int argc, char **argv) {
10  ros::init(argc, argv, "serviceProviderNode");
11  ros::NodeHandle private_nh("~");
12  double loop_rate;
13  private_nh.param("update_frequency", loop_rate, 20.0);
14  ros::Timer loop_timer = private_nh.createTimer(ros::Duration(1 / loop_rate),
15  loopCallback);
16  service_provider.reset(new rsm::ServiceProvider());
17  ros::spin();
18  service_provider.reset();
19  return 0;
20 }
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
ROSCPP_DECL void spin(Spinner &spinner)
void loopCallback(const ros::TimerEvent &)
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
Establishes communication between the different states and the RSM's periphery including the GUI...
boost::shared_ptr< rsm::ServiceProvider > service_provider
int main(int argc, char **argv)


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