Public Member Functions | Protected Attributes | List of all members
robot_nav_rviz_plugins::PolygonFill Class Reference

Constructs a manual ogre object to display the polygon area as a triangle mesh. More...

#include <polygon_parts.h>

Public Member Functions

 PolygonFill (Ogre::SceneManager &scene_manager, Ogre::SceneNode &scene_node, const std::string &material_name)
 
void reset ()
 
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. More...
 
void setPolygon (const nav_2d_msgs::ComplexPolygon2D &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. More...
 
virtual ~PolygonFill ()
 

Protected Attributes

unsigned int last_vertex_count_ { 0 }
 
Ogre::ManualObject * manual_object_
 
std::string material_name_
 
Ogre::SceneManager & scene_manager_
 
Ogre::SceneNode & scene_node_
 

Detailed Description

Constructs a manual ogre object to display the polygon area as a triangle mesh.

Definition at line 91 of file polygon_parts.h.

Constructor & Destructor Documentation

robot_nav_rviz_plugins::PolygonFill::PolygonFill ( Ogre::SceneManager &  scene_manager,
Ogre::SceneNode &  scene_node,
const std::string &  material_name 
)

Definition at line 84 of file polygon_parts.cpp.

robot_nav_rviz_plugins::PolygonFill::~PolygonFill ( )
virtual

Definition at line 93 of file polygon_parts.cpp.

Member Function Documentation

void robot_nav_rviz_plugins::PolygonFill::reset ( )

Definition at line 98 of file polygon_parts.cpp.

void robot_nav_rviz_plugins::PolygonFill::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.

Parameters
polygonPolygon to display
colorROS color value (includes alpha)
z_offsetAmount in meters to offset each two dimensional pose into the z direction

Definition at line 105 of file polygon_parts.cpp.

void robot_nav_rviz_plugins::PolygonFill::setPolygon ( const nav_2d_msgs::ComplexPolygon2D &  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.

Parameters
polygonComplex Polygon to display
colorROS color value (includes alpha)
z_offsetAmount in meters to offset each two dimensional pose into the z direction

Definition at line 112 of file polygon_parts.cpp.

Member Data Documentation

unsigned int robot_nav_rviz_plugins::PolygonFill::last_vertex_count_ { 0 }
protected

Definition at line 116 of file polygon_parts.h.

Ogre::ManualObject* robot_nav_rviz_plugins::PolygonFill::manual_object_
protected

Definition at line 115 of file polygon_parts.h.

std::string robot_nav_rviz_plugins::PolygonFill::material_name_
protected

Definition at line 120 of file polygon_parts.h.

Ogre::SceneManager& robot_nav_rviz_plugins::PolygonFill::scene_manager_
protected

Definition at line 118 of file polygon_parts.h.

Ogre::SceneNode& robot_nav_rviz_plugins::PolygonFill::scene_node_
protected

Definition at line 119 of file polygon_parts.h.


The documentation for this class was generated from the following files:


robot_nav_rviz_plugins
Author(s):
autogenerated on Sun Jan 10 2021 04:08:58