wrench_display.h
Go to the documentation of this file.
1 #ifndef WRENCHSTAMPED_DISPLAY_H
2 #define WRENCHSTAMPED_DISPLAY_H
3 
4 #ifndef Q_MOC_RUN
5 #include <boost/circular_buffer.hpp>
6 #endif
7 
8 #include <geometry_msgs/WrenchStamped.h>
10 
11 namespace Ogre
12 {
13 class SceneNode;
14 }
15 
16 namespace rviz
17 {
18 class ColorProperty;
19 class ROSTopicStringProperty;
20 class FloatProperty;
21 class IntProperty;
22 }
23 
24 namespace rviz
25 {
26 
27 class WrenchVisual;
28 
29 class WrenchStampedDisplay: public rviz::MessageFilterDisplay<geometry_msgs::WrenchStamped>
30 {
31  Q_OBJECT
32 public:
33  // Constructor. pluginlib::ClassLoader creates instances by calling
34  // the default constructor, so make sure you have one.
36  virtual ~WrenchStampedDisplay();
37 
38 protected:
39  // Overrides of public virtual functions from the Display class.
40  virtual void onInitialize();
41  virtual void reset();
42 
43 private Q_SLOTS:
44  // Helper function to apply color and alpha to all visuals.
45  void updateColorAndAlpha();
46  void updateHistoryLength();
47 
48 private:
49  // Function to handle an incoming ROS message.
50  void processMessage( const geometry_msgs::WrenchStamped::ConstPtr& msg );
51 
52  // Storage for the list of visuals par each joint intem
53  // Storage for the list of visuals. It is a circular buffer where
54  // data gets popped from the front (oldest) and pushed to the back (newest)
55  boost::circular_buffer<boost::shared_ptr<WrenchVisual> > visuals_;
56 
57  // Property objects for user-editable properties.
58  rviz::ColorProperty *force_color_property_, *torque_color_property_;
59  rviz::FloatProperty *alpha_property_, *force_scale_property_, *torque_scale_property_, *width_property_;
61 };
62 } // end namespace rviz_plugin_tutorials
63 
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.
Definition: int_property.h:38
Display subclass using a tf::MessageFilter, templated on the ROS message type.
rviz::FloatProperty * width_property_
rviz::ColorProperty * torque_color_property_


rviz
Author(s): Dave Hershberger, David Gossow, Josh Faust
autogenerated on Wed Aug 28 2019 04:01:52