Go to the documentation of this file.
119 Ogre::Vector3 position;
120 Ogre::Quaternion orientation;
123 ROS_DEBUG(
"Error transforming from frame '%s' to frame '%s'",
124 polygon2d.header.frame_id.c_str(), qPrintable(
fixed_frame_));
129 bool empty = polygon2d.polygon.points.empty();
Displays a geometry_msgs::PolygonStamped message in Rviz.
virtual QColor getColor() const
Ogre::ColourValue qtToOgre(const QColor &c)
Several reusable pieces for displaying polygons.
std_msgs::ColorRGBA getColor(rviz::ColorProperty *color_property, rviz::FloatProperty *alpha_property=nullptr)
Given a Color Property and an optional Float property, return a ROS Color message.
PolygonDisplayModeProperty * mode_property_
nav_2d_msgs::Polygon2D polygon3Dto2D(const geometry_msgs::Polygon &polygon_3d)
bool validateFloats(const nav_grid::NavGridInfo &info)
bool shouldDrawFiller() const
void setPolygon(const nav_2d_msgs::Polygon2D &polygon, const Ogre::ColourValue &color, double z_offset)
Set the object to display the outline of the given polygon, in a specific color, possibly offset in z...
void onInitialize() override
rviz::ColorProperty * filler_color_property_
const std::string & getName() const
virtual void setStatus(StatusProperty::Level level, const QString &name, const QString &text)
rviz::ColorProperty * outline_color_property_
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
virtual float getFloat() const
bool shouldDrawOutlines() const
Ogre::SceneNode * scene_node_
Ogre::SceneManager * scene_manager_
virtual FrameManager * getFrameManager() const=0
PolygonFill * filler_object_
void onInitialize() override
PolygonMaterial polygon_material_
bool getTransform(const Header &header, Ogre::Vector3 &position, Ogre::Quaternion &orientation)
DisplayContext * context_
void processMessage(const geometry_msgs::PolygonStamped::ConstPtr &msg) override
void setPolygon(const nav_2d_msgs::Polygon2D &polygon, const std_msgs::ColorRGBA &color, double z_offset)
Set the object to display the area of the given polygon, in a specific color, possibly offset in z.
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.
rviz::FloatProperty * zoffset_property_
PolygonOutline * outline_object_
virtual ~Polygon3DDisplay()