4 #include <std_msgs/Int32.h> 15 const std::string& service_topic_name)
29 ros1_template_msgs::Answer::Response &response)
33 std::stringstream log_prefix_string_stream;
35 std::string log_prefix = log_prefix_string_stream.str();
38 response.answer = next_number;
std::shared_ptr< AtomicFibonacci > AtomicFibonacciPtr
ServiceServer advertiseService(const std::string &service, bool(T::*srv_func)(MReq &, MRes &), T *obj)
ros1_cpptemplate::AtomicFibonacciPtr atomic_fibonacci_
AtomicFibonacci supplier (shared)
std::string getService() const
ros::ServiceServer service_
Actual service.
#define ROS_INFO_STREAM(args)
virtual bool serve(ros1_template_msgs::Answer::Request &request, ros1_template_msgs::Answer::Response &response)