30 #ifndef RVIZ_ILLUMINANCE_DISPLAY_H    31 #define RVIZ_ILLUMINANCE_DISPLAY_H    33 #include <sensor_msgs/Illuminance.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::IlluminanceConstPtr& msg );
 
PointCloudCommon * point_cloud_common_
IntProperty * queue_size_property_
Displays an Illuminance message of type sensor_msgs::Illuminance. 
virtual void processMessage(const sensor_msgs::IlluminanceConstPtr &msg)
Process a single message. Overridden from MessageFilterDisplay. 
Property specialized to provide max/min enforcement for integers. 
virtual void update(float wall_dt, float ros_dt)
Called periodically by the visualization manager. 
Displays a point cloud of type sensor_msgs::PointCloud. 
Display subclass using a tf::MessageFilter, templated on the ROS message type. 
virtual void onInitialize()
Do initialization. Overridden from MessageFilterDisplay. 
virtual void reset()
Called to tell the display to clear its state.