#include <ros.h>#include <std_msgs/String.h>#include <stdio.h>
Go to the source code of this file.
| Functions | |
| int | main () | 
| void | messageCb (const std_msgs::String &received_msg) | 
| Variables | |
| ros::NodeHandle | nh | 
| char * | rosSrvrIp = "192.168.15.149" | 
| ros::Subscriber< std_msgs::String > | sub ("chatter", messageCb) | 
| int main | ( | ) | 
Definition at line 21 of file ExampleSubscriber.cpp.
| void messageCb | ( | const std_msgs::String & | received_msg | ) | 
Definition at line 16 of file ExampleSubscriber.cpp.
Definition at line 13 of file ExampleSubscriber.cpp.
| char* rosSrvrIp = "192.168.15.149" | 
Definition at line 14 of file ExampleSubscriber.cpp.
| ros::Subscriber<std_msgs::String> sub("chatter", messageCb) |