#include "rosADK.h"#include <std_msgs/String.h>#include <std_msgs/Empty.h>#include <util/delay.h>
Go to the source code of this file.
Functions | |
| void | loop () |
| void | messageCb (const std_msgs::Empty &toggle_msg) |
| void | setup () |
Variables | |
| ros::Publisher | chatter ("chatter",&str_msg) |
| char | hello [13] = "hello world!" |
| ros::NodeHandle | nh |
| char | rsp_str [] = "responding to toggle" |
| std_msgs::String | str_msg |
| ros::Subscriber< std_msgs::Empty > | sub ("toggle_led", messageCb) |
| void loop | ( | ) |
Definition at line 41 of file pubsub.cpp.
| void messageCb | ( | const std_msgs::Empty & | toggle_msg | ) |
Definition at line 20 of file pubsub.cpp.
| void setup | ( | ) |
Definition at line 33 of file pubsub.cpp.
| ros::Publisher chatter("chatter",&str_msg) |
| char hello[13] = "hello world!" |
Definition at line 31 of file pubsub.cpp.
Definition at line 13 of file pubsub.cpp.
| char rsp_str[] = "responding to toggle" |
Definition at line 18 of file pubsub.cpp.
| std_msgs::String str_msg |
Definition at line 15 of file pubsub.cpp.
| ros::Subscriber<std_msgs::Empty> sub("toggle_led", messageCb) |