30 #ifndef RANGE_DISPLAY_H 31 #define RANGE_DISPLAY_H 33 #include <sensor_msgs/Range.h> 68 virtual void processMessage(
const sensor_msgs::Range::ConstPtr& msg );
std::vector< Shape * > cones_
Handles actually drawing the cones.
ColorProperty * color_property_
void updateColorAndAlpha()
Property specialized to enforce floating point max/min.
Property specialized to provide max/min enforcement for integers.
void updateBufferLength()
virtual void onInitialize()
Overridden from Display.
Display subclass using a tf::MessageFilter, templated on the ROS message type.
IntProperty * queue_size_property_
FloatProperty * alpha_property_
Displays a sensor_msgs::Range message as a cone.
virtual void processMessage(const sensor_msgs::Range::ConstPtr &msg)
Overridden from MessageFilterDisplay.
IntProperty * buffer_length_property_
virtual void reset()
Overridden from Display.