#include "mbed.h"
#include <ros.h>
#include <std_msgs/Bool.h>
Go to the source code of this file.
Functions | |
int | main () |
Variables | |
std_msgs::Bool | motion_msg |
ros::NodeHandle | nh |
ros::Publisher | pub_motion ("motion",&motion_msg) |
Timer | t |
int main | ( | void | ) |
Definition at line 30 of file GrovePIRMotionSensor.cpp.
std_msgs::Bool motion_msg |
Definition at line 18 of file GrovePIRMotionSensor.cpp.
Definition at line 16 of file GrovePIRMotionSensor.cpp.
ros::Publisher pub_motion("motion",&motion_msg) |
Timer t |
Definition at line 21 of file GrovePIRMotionSensor.cpp.