22 #ifndef THERMAL_SENSOR_H 23 #define THERMAL_SENSOR_H 27 #include <stdr_msgs/ThermalSensorMsg.h> 28 #include <stdr_msgs/ThermalSensorMeasurementMsg.h> 29 #include <stdr_msgs/ThermalSourceVector.h> 55 const nav_msgs::OccupancyGrid& map,
56 const stdr_msgs::ThermalSensorMsg& msg,
57 const std::string& name,
stdr_msgs::ThermalSensorMsg _description
< thermal sensor description
ros::Subscriber thermal_sources_subscriber_
The currently existent sources.
The main namespace for STDR Robot.
A class that provides sensor abstraction.
stdr_msgs::ThermalSourceVector thermal_sources_
ThermalSensor(const nav_msgs::OccupancyGrid &map, const stdr_msgs::ThermalSensorMsg &msg, const std::string &name, ros::NodeHandle &n)
Default constructor.
virtual void updateSensorCallback()
Updates the sensor measurements.
void receiveThermalSources(const stdr_msgs::ThermalSourceVector &msg)
Receives the existent sound sources.
~ThermalSensor(void)
Default destructor.