30 #ifndef POSE_WITH_COVARIANCE_DISPLAY_H 31 #define POSE_WITH_COVARIANCE_DISPLAY_H 33 #include <boost/shared_ptr.hpp> 35 #include <geometry_msgs/PoseWithCovarianceStamped.h> 51 class CovarianceVisual;
52 class CovarianceProperty;
88 virtual void processMessage(
const geometry_msgs::PoseWithCovarianceStamped::ConstPtr& message );
116 #endif // POSE_WITH_COVARIANCE_DISPLAY_H rviz::FloatProperty * head_length_property_
Displays the pose from a geometry_msgs::PoseWithCovarianceStamped message.
rviz::FloatProperty * axes_length_property_
void updateArrowGeometry()
virtual void processMessage(const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &message)
void updateShapeVisibility()
PoseWithCovarianceDisplay()
Property specialized to enforce floating point max/min.
rviz::EnumProperty * shape_property_
rviz::FloatProperty * axes_radius_property_
boost::shared_ptr< PoseWithCovarianceDisplaySelectionHandler > PoseWithCovarianceDisplaySelectionHandlerPtr
CovarianceProperty * covariance_property_
boost::shared_ptr< CovarianceVisual > covariance_
rviz::FloatProperty * head_radius_property_
Display subclass using a tf::MessageFilter, templated on the ROS message type.
virtual void reset()
Called to tell the display to clear its state.
An object that displays a set of X/Y/Z axes, with X=Red, Y=Green, Z=Blue.
rviz::FloatProperty * alpha_property_
PoseWithCovarianceDisplaySelectionHandlerPtr coll_handler_
virtual void onInitialize()
Override this function to do subclass-specific initialization.
rviz::ColorProperty * color_property_
virtual ~PoseWithCovarianceDisplay()
void updateColorAndAlpha()
void updateAxisGeometry()
Property specialized to provide getter for booleans.
rviz::FloatProperty * shaft_length_property_
An arrow consisting of a cylinder and a cone.
virtual void onEnable()
Overridden from MessageFilterDisplay to get Arrow/Axes visibility correct.
rviz::FloatProperty * shaft_radius_property_