Functions | Variables
Temperature.cpp File Reference
#include "mbed.h"
#include <ros.h>
#include <std_msgs/Float32.h>
Include dependency graph for Temperature.cpp:

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
 

Function Documentation

◆ main()

int main ( void  )

Definition at line 42 of file Temperature.cpp.

Variable Documentation

◆ nh

Definition at line 16 of file Temperature.cpp.

◆ pub_temp

ros::Publisher pub_temp("temperature", &temp_msg)

◆ sensorAddress

int sensorAddress = 0x91 >>1

Definition at line 29 of file Temperature.cpp.

◆ t

Timer t

Definition at line 33 of file Temperature.cpp.

◆ temp_msg

std_msgs::Float32 temp_msg

Definition at line 18 of file Temperature.cpp.



rosserial_mbed
Author(s): Gary Servin
autogenerated on Mon Feb 28 2022 23:35:26