33 #ifndef PATH_DISPLAY_H 34 #define PATH_DISPLAY_H 37 #include <boost/circular_buffer.hpp> 40 #include <nav_msgs/Path.h> 84 virtual void onInitialize();
91 void updatePathColor();
93 void updatePathScale();
95 void updateOrientColor();
96 void updateOrientShape();
97 void updateOrientScale();
98 void updateOrientDeltaS();
100 void updateHistoryLength();
104 void processMessage(
const nav_msgs::Path::ConstPtr& msg );
108 boost::circular_buffer<boost::shared_ptr<PathVisual> >
visuals_;
130 #endif // PATH_DISPLAY_H
rviz::FloatProperty * scale_path_property_
rviz::EnumProperty * shape_property_
rviz::FloatProperty * path_delta_s_orient_property_
rviz::IntProperty * history_length_property_
rviz::ColorProperty * color_path_property_
rviz::FloatProperty * scale_orient_property_
rviz::ColorProperty * color_orient_property_
boost::circular_buffer< boost::shared_ptr< PathVisual > > visuals_