16 #include <std_msgs/String.h> 17 #include <rosserial_embeddedlinux/Test.h> 21 using rosserial_embeddedlinux::Test;
22 #define ROSSRVR_IP "192.168.15.149" 29 char hello[13] =
"hello world!";
36 while(!nh.connected()) nh.spinOnce();
37 printf(
"Startup complete\n");
43 printf(
"Service responded with \"%s\"\n", res.output);
ServiceClient serviceClient(const std::string &service_name, bool persistent=false, const M_string &header_values=M_string())
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
ros::ServiceClient< Test::Request, Test::Response > client("test_srv")
ros::Publisher chatter("chatter",&str_msg)