6 #include <std_msgs/String.h> 7 #include <rosserial_mbed/Test.h> 10 using rosserial_mbed::Test;
13 void callback(
const Test::Request & req, Test::Response & res) {
25 char hello[13] =
"hello world!";
void publish(const boost::shared_ptr< M > &message) const
void callback(const Test::Request &req, Test::Response &res)
ServiceServer advertiseService(const std::string &service, bool(T::*srv_func)(MReq &, MRes &), T *obj)
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
ros::ServiceServer< Test::Request, Test::Response > server("test_srv",&callback)
ros::Publisher chatter("chatter",&str_msg)