#include <ros.h>
#include <std_msgs/String.h>
#include <rosserial_embeddedlinux/Test.h>
#include <stdio.h>
Go to the source code of this file.
Defines | |
#define | ROSSRVR_IP "192.168.15.149" |
Functions | |
int | main () |
Variables | |
ros::Publisher | chatter ("chatter",&str_msg) |
ros::ServiceClient < Test::Request, Test::Response > | client ("test_srv") |
char | hello [13] = "hello world!" |
ros::NodeHandle | nh |
std_msgs::String | str_msg |
#define ROSSRVR_IP "192.168.15.149" |
Definition at line 22 of file ExampleServiceClient.cpp.
int main | ( | ) |
Definition at line 31 of file ExampleServiceClient.cpp.
ros::Publisher chatter("chatter",&str_msg) |
ros::ServiceClient<Test::Request, Test::Response> client("test_srv") |
char hello[13] = "hello world!" |
Definition at line 29 of file ExampleServiceClient.cpp.
Definition at line 20 of file ExampleServiceClient.cpp.
std_msgs::String str_msg |
Definition at line 26 of file ExampleServiceClient.cpp.