#include <nav_2d_msgs/Polygon2D.h>
#include <nav_2d_msgs/ComplexPolygon2D.h>
#include <OgreManualObject.h>
#include <OgreSceneManager.h>
#include <rviz/properties/color_property.h>
#include <rviz/properties/enum_property.h>
#include <rviz/properties/float_property.h>
#include <std_msgs/ColorRGBA.h>
#include <string>
Go to the source code of this file.
Classes | |
class | robot_nav_rviz_plugins::PolygonDisplayModeProperty |
Wrapper for EnumProperty + enum for whether to display the outline, area, or both. More... | |
class | robot_nav_rviz_plugins::PolygonFill |
Constructs a manual ogre object to display the polygon area as a triangle mesh. More... | |
class | robot_nav_rviz_plugins::PolygonMaterial |
Wrapper that creates a flat semi-transparent Ogre material and gives it a name. More... | |
class | robot_nav_rviz_plugins::PolygonOutline |
Constructs a manual ogre object to display the polygon outline as a line strip. More... | |
Namespaces | |
robot_nav_rviz_plugins | |
Several reusable pieces for displaying polygons. | |
Functions | |
std_msgs::ColorRGBA | robot_nav_rviz_plugins::getColor (rviz::ColorProperty *color_property, rviz::FloatProperty *alpha_property=nullptr) |
Given a Color Property and an optional Float property, return a ROS Color message. More... | |