#include "mbed.h"#include <ros.h>#include <ros/time.h>#include <sensor_msgs/Range.h>
Go to the source code of this file.
Functions | |
| float | getRange_Ultrasound (PinName pin_num) |
| int | main () |
Variables | |
| char | frameid [] = "/ultrasound" |
| ros::NodeHandle | nh |
| ros::Publisher | pub_range ("/ultrasound",&range_msg) |
| sensor_msgs::Range | range_msg |
| Timer | t |
| float getRange_Ultrasound | ( | PinName | pin_num | ) |
Definition at line 27 of file Ultrasound.cpp.
| int main | ( | void | ) |
Definition at line 35 of file Ultrasound.cpp.
| char frameid[] = "/ultrasound" |
Definition at line 25 of file Ultrasound.cpp.
Definition at line 12 of file Ultrasound.cpp.
| ros::Publisher pub_range("/ultrasound",&range_msg) |
| sensor_msgs::Range range_msg |
Definition at line 14 of file Ultrasound.cpp.
| Timer t |
Definition at line 34 of file Ultrasound.cpp.