#include <barometer.hpp>

Public Member Functions | |
| PressureSensor (ros::NodeHandle *nh, const char *topic, double period) | |
| bool | publish (float staticPressureHpa) |
Public Member Functions inherited from BaseSensor | |
| BaseSensor ()=delete | |
| BaseSensor (ros::NodeHandle *nh, double period) | |
| void | disable () |
| void | enable () |
Additional Inherited Members | |
Protected Attributes inherited from BaseSensor | |
| bool | _isEnabled {false} |
| double | nextPubTimeSec_ = 0 |
| ros::NodeHandle * | node_handler_ |
| std::normal_distribution< double > | normalDistribution_ {std::normal_distribution<double>(0.0, 1.0)} |
| const double | PERIOD |
| ros::Publisher | publisher_ |
| std::default_random_engine | randomGenerator_ |
Definition at line 24 of file barometer.hpp.
| PressureSensor::PressureSensor | ( | ros::NodeHandle * | nh, |
| const char * | topic, | ||
| double | period | ||
| ) |
Definition at line 25 of file barometer.cpp.
| bool PressureSensor::publish | ( | float | staticPressureHpa | ) |
Definition at line 28 of file barometer.cpp.