33 #ifndef SPLINE_DISPLAY_H 34 #define SPLINE_DISPLAY_H 37 #include <boost/circular_buffer.hpp> 40 #include <tuw_nav_msgs/Spline.h> 84 virtual void onInitialize();
91 void updatePathColor();
93 void updatePathScale();
96 void updateOrientColor();
97 void updateOrientShape();
98 void updateOrientScale();
99 void updateOrientDs ();
101 void updateHistoryLength();
105 void processMessage(
const tuw_nav_msgs::Spline::ConstPtr& msg );
109 boost::circular_buffer<boost::shared_ptr<SplineVisual> >
visuals_;
127 #endif // SPLINE_DISPLAY_H
boost::circular_buffer< boost::shared_ptr< SplineVisual > > visuals_
rviz::EnumProperty * shape_property_
rviz::ColorProperty * color_path_property_
rviz::ColorProperty * color_orient_property_
rviz::FloatProperty * ds_orient_property_
rviz::FloatProperty * ds_path_property_
rviz::FloatProperty * scale_path_property_
rviz::IntProperty * history_length_property_
rviz::FloatProperty * scale_orient_property_