30 #ifndef RVIZ_TEMPERATURE_DISPLAY_H 31 #define RVIZ_TEMPERATURE_DISPLAY_H 33 #include <sensor_msgs/Temperature.h> 34 #include <sensor_msgs/PointCloud2.h> 42 class PointCloudCommon;
58 virtual void update(
float wall_dt,
float ros_dt );
68 virtual void processMessage(
const sensor_msgs::TemperatureConstPtr& msg );
virtual void reset()
Called to tell the display to clear its state.
Property specialized to provide max/min enforcement for integers.
Displays a point cloud of type sensor_msgs::PointCloud.
PointCloudCommon * point_cloud_common_
Display subclass using a tf::MessageFilter, templated on the ROS message type.
virtual void update(float wall_dt, float ros_dt)
Called periodically by the visualization manager.
virtual void onInitialize()
Do initialization. Overridden from MessageFilterDisplay.
Displays a Temperature message of type sensor_msgs::Temperature.
virtual void processMessage(const sensor_msgs::TemperatureConstPtr &msg)
Process a single message. Overridden from MessageFilterDisplay.
IntProperty * queue_size_property_