Go to the documentation of this file. 1 #ifndef POINT_DISPLAY_H
2 #define POINT_DISPLAY_H
5 #include <boost/circular_buffer.hpp>
8 #include <geometry_msgs/PointStamped.h>
26 class PointStampedVisual;
40 void reset()
override;
49 void processMessage(
const geometry_msgs::PointStamped::ConstPtr& msg)
override;
53 boost::circular_buffer<boost::shared_ptr<PointStampedVisual> >
visuals_;
62 #endif // POINT_DISPLAY_H
Display subclass using a tf2_ros::MessageFilter, templated on the ROS message type.
void updateColorAndAlpha()
rviz::IntProperty * history_length_property_
Property specialized to enforce floating point max/min.
void onInitialize() override
Override this function to do subclass-specific initialization.
rviz::ColorProperty * color_property_
void updateHistoryLength()
void processMessage(const geometry_msgs::PointStamped::ConstPtr &msg) override
rviz::FloatProperty * radius_property_
void reset() override
Called to tell the display to clear its state.
~PointStampedDisplay() override
boost::circular_buffer< boost::shared_ptr< PointStampedVisual > > visuals_
rviz::FloatProperty * alpha_property_
Property specialized to provide max/min enforcement for integers.
rviz
Author(s): Dave Hershberger, David Gossow, Josh Faust, William Woodall
autogenerated on Fri Aug 2 2024 08:43:10