#include "mbed.h"
#include <ros.h>
#include <std_msgs/Float32.h>
Go to the source code of this file.
Functions | |
int | main () |
Variables | |
ros::NodeHandle | nh |
ros::Publisher | pub_temp ("temperature",&temp_msg) |
int | sensorAddress = 0x91 >>1 |
Timer | t |
std_msgs::Float32 | temp_msg |
int main | ( | void | ) |
Definition at line 42 of file Temperature.cpp.
Definition at line 16 of file Temperature.cpp.
ros::Publisher pub_temp("temperature",&temp_msg) |
int sensorAddress = 0x91 >>1 |
Definition at line 29 of file Temperature.cpp.
Timer t |
Definition at line 33 of file Temperature.cpp.
std_msgs::Float32 temp_msg |
Definition at line 18 of file Temperature.cpp.