30 #ifndef RVIZ_ILLUMINANCE_DISPLAY_H 31 #define RVIZ_ILLUMINANCE_DISPLAY_H 33 #include <sensor_msgs/Illuminance.h> 34 #include <sensor_msgs/PointCloud2.h> 41 class PointCloudCommon;
55 void reset()
override;
57 void update(
float wall_dt,
float ros_dt)
override;
67 void processMessage(
const sensor_msgs::IlluminanceConstPtr& msg)
override;
PointCloudCommon * point_cloud_common_
~IlluminanceDisplay() override
IntProperty * queue_size_property_
Displays an Illuminance message of type sensor_msgs::Illuminance.
void reset() override
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.
void processMessage(const sensor_msgs::IlluminanceConstPtr &msg) override
Process a single message. Overridden from MessageFilterDisplay.
void onInitialize() override
Do initialization. Overridden from MessageFilterDisplay.
Display subclass using a tf2_ros::MessageFilter, templated on the ROS message type.
void update(float wall_dt, float ros_dt) override
Called periodically by the visualization manager.