#include "mbed.h"
#include <ros.h>
#include <std_msgs/String.h>
#include <std_msgs/Empty.h>
Go to the source code of this file.
Functions | |
int | main () |
void | messageCb (const std_msgs::Empty &toggle_msg) |
DigitalOut | myled (LED1) |
Variables | |
ros::Publisher | chatter ("chatter",&str_msg) |
char | hello [13] = "hello world!" |
ros::NodeHandle | nh |
std_msgs::String | str_msg |
ros::Subscriber< std_msgs::Empty > | sub ("toggle_led", messageCb) |
int main | ( | void | ) |
Definition at line 24 of file pubsub.cpp.
void messageCb | ( | const std_msgs::Empty & | toggle_msg | ) |
Definition at line 13 of file pubsub.cpp.
DigitalOut myled | ( | LED1 | ) |
ros::Publisher chatter("chatter",&str_msg) |
char hello[13] = "hello world!" |
Definition at line 22 of file pubsub.cpp.
Definition at line 10 of file pubsub.cpp.
std_msgs::String str_msg |
Definition at line 19 of file pubsub.cpp.
ros::Subscriber<std_msgs::Empty> sub("toggle_led", messageCb) |