1 #ifndef WRENCHSTAMPED_DISPLAY_H 2 #define WRENCHSTAMPED_DISPLAY_H 5 #include <boost/circular_buffer.hpp> 8 #include <geometry_msgs/WrenchStamped.h> 19 class ROSTopicStringProperty;
40 virtual void onInitialize();
45 void updateColorAndAlpha();
46 void updateHistoryLength();
50 void processMessage(
const geometry_msgs::WrenchStamped::ConstPtr& msg );
55 boost::circular_buffer<boost::shared_ptr<WrenchVisual> >
visuals_;
64 #endif // WRENCHSTAMPED_DISPLAY_H
boost::circular_buffer< boost::shared_ptr< WrenchVisual > > visuals_
rviz::IntProperty * history_length_property_
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 * width_property_
rviz::ColorProperty * torque_color_property_