30 #ifndef VORONOIGRAPHDISPLAY_H 31 #define VORONOIGRAPHDISPLAY_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 VoronoiGraphVisual;
102 virtual void onInitialize();
105 virtual void reset();
109 void updatePathColor();
110 void updatePointScale();
111 void updatePathScale();
113 void updateHistoryLength();
117 void processMessage(
const tuw_multi_robot_msgs::Graph::ConstPtr& msg );
121 boost::circular_buffer<boost::shared_ptr<VoronoiGraphVisual> >
visuals_;
138 #endif // IMU_DISPLAY_H 139 // %EndTag(FULL_SOURCE)%
rviz::FloatProperty * scale_path_property_
rviz::ColorProperty * color_path_property_
boost::circular_buffer< boost::shared_ptr< VoronoiGraphVisual > > visuals_
rviz::IntProperty * history_length_property_
rviz::FloatProperty * scale_point_property_