30 #ifndef RVIZ_LASER_SCAN_DISPLAY_H 31 #define RVIZ_LASER_SCAN_DISPLAY_H 33 #include <sensor_msgs/LaserScan.h> 39 class LaserProjection;
46 class PointCloudCommon;
58 virtual void update(
float wall_dt,
float ros_dt );
61 void updateQueueSize();
65 virtual void onInitialize();
68 virtual void processMessage(
const sensor_msgs::LaserScanConstPtr& scan );
laser_geometry::LaserProjection * projector_
Property specialized to provide max/min enforcement for integers.
Displays a point cloud of type sensor_msgs::PointCloud.
void update(const std::string &key, const XmlRpc::XmlRpcValue &v)
Display subclass using a tf::MessageFilter, templated on the ROS message type.
IntProperty * queue_size_property_
Visualizes a laser scan, received as a sensor_msgs::LaserScan.
ros::Duration filter_tolerance_
PointCloudCommon * point_cloud_common_