Go to the documentation of this file.
34 #ifndef ROBOT_NAV_RVIZ_PLUGINS_POLYGON3D_DISPLAY_H
35 #define ROBOT_NAV_RVIZ_PLUGINS_POLYGON3D_DISPLAY_H
37 #include <geometry_msgs/PolygonStamped.h>
43 #include <OgreManualObject.h>
44 #include <OgreMaterial.h>
59 void reset()
override;
63 void processMessage(
const geometry_msgs::PolygonStamped::ConstPtr& msg)
override;
81 #endif // ROBOT_NAV_RVIZ_PLUGINS_POLYGON3D_DISPLAY_H
Displays a geometry_msgs::PolygonStamped message in Rviz.
Several reusable pieces for displaying polygons.
PolygonDisplayModeProperty * mode_property_
void onInitialize() override
rviz::ColorProperty * filler_color_property_
rviz::ColorProperty * outline_color_property_
PolygonFill * filler_object_
PolygonMaterial polygon_material_
void processMessage(const geometry_msgs::PolygonStamped::ConstPtr &msg) override
rviz::FloatProperty * filler_alpha_property_
Constructs a manual ogre object to display the polygon area as a triangle mesh.
Wrapper for EnumProperty + enum for whether to display the outline, area, or both.
Constructs a manual ogre object to display the polygon outline as a line strip.
Wrapper that creates a flat semi-transparent Ogre material and gives it a name.
rviz::FloatProperty * zoffset_property_
PolygonOutline * outline_object_
virtual ~Polygon3DDisplay()