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;
39 void onInitialize()
override;
40 void reset()
override;
44 void updateProperties();
45 void updateHistoryLength();
49 void processMessage(
const geometry_msgs::WrenchStamped::ConstPtr& msg)
override;
54 boost::circular_buffer<boost::shared_ptr<WrenchVisual> >
visuals_;
65 #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 tf2_ros::MessageFilter, templated on the ROS message type.
rviz::FloatProperty * width_property_
Property specialized to provide getter for booleans.
rviz::BoolProperty * hide_small_values_property_
rviz::ColorProperty * torque_color_property_