#include <ros.h>#include <std_msgs/String.h>#include <rosserial_mbed/Test.h>
Go to the source code of this file.
Functions | |
| void | callback (const Test::Request &req, Test::Response &res) |
| int | main (void) |
Variables | |
| ros::Publisher | chatter ("chatter",&str_msg) |
| char | hello [13] = "hello world!" |
| int | i |
| ros::NodeHandle | nh |
| ros::ServiceServer< Test::Request, Test::Response > | server ("test_srv",&callback) |
| std_msgs::String | str_msg |
| void callback | ( | const Test::Request & | req, |
| Test::Response & | res | ||
| ) |
Definition at line 13 of file ServiceServer.cpp.
| int main | ( | void | ) |
Definition at line 27 of file ServiceServer.cpp.
| ros::Publisher chatter("chatter",&str_msg) |
| char hello[13] = "hello world!" |
Definition at line 25 of file ServiceServer.cpp.
| int i |
Definition at line 12 of file ServiceServer.cpp.
Definition at line 9 of file ServiceServer.cpp.
| ros::ServiceServer<Test::Request, Test::Response> server("test_srv",&callback) |
| std_msgs::String str_msg |
Definition at line 22 of file ServiceServer.cpp.