30 #ifndef VORONOISEGMENTDISPLAY_H 31 #define VORONOISEGMENTDISPLAY_H 33 #include <boost/circular_buffer.hpp> 36 #include <tuw_multi_robot_msgs/Graph.h> 40 #include <boost/circular_buffer.hpp> 43 #include <nav_msgs/Path.h> 68 class VoronoiSegmentVisual;
102 virtual void onInitialize();
105 virtual void reset();
109 void updatePathColor();
110 void updatePathScale();
112 void updateHistoryLength();
116 void processMessage(
const tuw_multi_robot_msgs::Graph::ConstPtr& msg );
120 boost::circular_buffer<boost::shared_ptr<VoronoiSegmentVisual> >
visuals_;
137 #endif // IMU_DISPLAY_H 138 // %EndTag(FULL_SOURCE)%
rviz::FloatProperty * scale_point_property_
rviz::FloatProperty * scale_path_property_
rviz::ColorProperty * color_path_property_
rviz::IntProperty * history_length_property_
boost::circular_buffer< boost::shared_ptr< VoronoiSegmentVisual > > visuals_