1 #ifndef POINT_DISPLAY_H     2 #define POINT_DISPLAY_H     5 #include <boost/circular_buffer.hpp>     8 #include <geometry_msgs/PointStamped.h>    27     class PointStampedVisual;
    40         virtual void onInitialize();
    45         void updateColorAndAlpha();
    46         void updateHistoryLength();
    50         void processMessage( 
const geometry_msgs::PointStamped::ConstPtr& msg );
    54         boost::circular_buffer<boost::shared_ptr<PointStampedVisual> > 
visuals_;
    64 #endif // POINT_DISPLAY_H boost::circular_buffer< boost::shared_ptr< PointStampedVisual > > visuals_
Property specialized to enforce floating point max/min. 
Property specialized to provide max/min enforcement for integers. 
Display subclass using a tf::MessageFilter, templated on the ROS message type. 
rviz::FloatProperty * radius_property_
rviz::IntProperty * history_length_property_
rviz::ColorProperty * color_property_