▼Nrobot_nav_rviz_plugins | Several reusable pieces for displaying polygons |
CBluesPalette | Palette with a gradient of blues from dark to light |
CCostmapPalette | Same as rviz::MapDisplay costmap palette. See https://github.com/ros-visualization/rviz/blob/4b6c0f447159044bfaa633e140e6094b19516b02/src/rviz/default_plugin/map_display.cpp#324 |
CDistinctPalette | List of distinct colors for displaying individual categories |
CMapPalette | Same as rviz::MapDisplay map palette. See https://github.com/ros-visualization/rviz/blob/4b6c0f447159044bfaa633e140e6094b19516b02/src/rviz/default_plugin/map_display.cpp#L286 |
CNavGridDisplay | Displays a nav_grid (of unspecified type) along the XY plane |
CNavGridOfCharsDisplay | Displays a nav_grid of chars along the XY plane |
CNavGridOfDoublesDisplay | Displays a nav_grid of doubles along the XY plane |
CNavGridPalette | A simple datastructure representing a palette of up to 256 24-bit colors |
COccupancyGridDisplay | Displays an OccupancyGrid along the XY plane |
▼COgrePanel | A collection of Ogre objects for rendering a two-dimensional rectangular plane (such as a map) in rviz |
CPartialOgrePanel | Portion of the larger OgrePanel....see above |
CPathDisplay | Displays a nav_2d_msgs::Path2D message in Rviz |
CPolygon3DDisplay | Displays a geometry_msgs::PolygonStamped message in Rviz |
CPolygonDisplay | Displays a nav_2d_msgs::Polygon2DStamped message in Rviz |
CPolygonDisplayModeProperty | Wrapper for EnumProperty + enum for whether to display the outline, area, or both |
CPolygonFill | Constructs a manual ogre object to display the polygon area as a triangle mesh |
CPolygonMaterial | Wrapper that creates a flat semi-transparent Ogre material and gives it a name |
CPolygonOutline | Constructs a manual ogre object to display the polygon outline as a line strip |
CPolygonsDisplay | Displays a nav_2d_msgs::Polygon2DCollection message in Rviz |
CRainbow2Palette | Rainbow hued palette from red to purple with transparent 0 |
CRainbowPalette | Rainbow hued palette from purple to red with transparent 0 |
CRawPalette | Same as rviz::MapDisplay raw palette. See https://github.com/ros-visualization/rviz/blob/4b6c0f447159044bfaa633e140e6094b19516b02/src/rviz/default_plugin/map_display.cpp#379 |
CSpectrumPalette | Easy class to generate palettes that simply blend two colors together |