Constructs a manual ogre object to display the polygon area as a triangle mesh.
More...
#include <polygon_parts.h>
|
| 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 () |
|
Constructs a manual ogre object to display the polygon area as a triangle mesh.
Definition at line 91 of file polygon_parts.h.
robot_nav_rviz_plugins::PolygonFill::PolygonFill |
( |
Ogre::SceneManager & |
scene_manager, |
|
|
Ogre::SceneNode & |
scene_node, |
|
|
const std::string & |
material_name |
|
) |
| |
robot_nav_rviz_plugins::PolygonFill::~PolygonFill |
( |
| ) |
|
|
virtual |
void robot_nav_rviz_plugins::PolygonFill::reset |
( |
| ) |
|
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
-
polygon | Polygon to display |
color | ROS color value (includes alpha) |
z_offset | Amount 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
-
polygon | Complex Polygon to display |
color | ROS color value (includes alpha) |
z_offset | Amount in meters to offset each two dimensional pose into the z direction |
Definition at line 112 of file polygon_parts.cpp.
unsigned int robot_nav_rviz_plugins::PolygonFill::last_vertex_count_ { 0 } |
|
protected |
Ogre::ManualObject* robot_nav_rviz_plugins::PolygonFill::manual_object_ |
|
protected |
std::string robot_nav_rviz_plugins::PolygonFill::material_name_ |
|
protected |
Ogre::SceneManager& robot_nav_rviz_plugins::PolygonFill::scene_manager_ |
|
protected |
Ogre::SceneNode& robot_nav_rviz_plugins::PolygonFill::scene_node_ |
|
protected |
The documentation for this class was generated from the following files: