Functions | Variables
ServiceClient.cpp File Reference
#include <ros.h>
#include <std_msgs/String.h>
#include <rosserial_mbed/Test.h>
Include dependency graph for ServiceClient.cpp:

Go to the source code of this file.

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

Function Documentation

int main ( void  )

Definition at line 19 of file ServiceClient.cpp.


Variable Documentation

ros::Publisher chatter("chatter",&str_msg)
ros::ServiceClient<Test::Request, Test::Response> client("test_srv")
char hello[13] = "hello world!"

Definition at line 17 of file ServiceClient.cpp.

Definition at line 9 of file ServiceClient.cpp.

std_msgs::String str_msg

Definition at line 14 of file ServiceClient.cpp.



rosserial_mbed
Author(s): Gary Servin
autogenerated on Sat Oct 7 2017 03:08:46