Classes | Functions
robot_nav_rviz_plugins Namespace Reference

Several reusable pieces for displaying polygons. More...

Classes

class  BluesPalette
 Palette with a gradient of blues from dark to light. More...
 
class  CostmapPalette
 Same as rviz::MapDisplay costmap palette. See https://github.com/ros-visualization/rviz/blob/4b6c0f447159044bfaa633e140e6094b19516b02/src/rviz/default_plugin/map_display.cpp#324. More...
 
class  DistinctPalette
 List of distinct colors for displaying individual categories. More...
 
class  MapPalette
 Same as rviz::MapDisplay map palette. See https://github.com/ros-visualization/rviz/blob/4b6c0f447159044bfaa633e140e6094b19516b02/src/rviz/default_plugin/map_display.cpp#L286. More...
 
class  NavGridDisplay
 Displays a nav_grid (of unspecified type) along the XY plane. More...
 
class  NavGridOfCharsDisplay
 Displays a nav_grid of chars along the XY plane. More...
 
class  NavGridOfDoublesDisplay
 Displays a nav_grid of doubles along the XY plane. More...
 
class  NavGridPalette
 A simple datastructure representing a palette of up to 256 24-bit colors. More...
 
class  OccupancyGridDisplay
 Displays an OccupancyGrid along the XY plane. More...
 
class  OgrePanel
 A collection of Ogre objects for rendering a two-dimensional rectangular plane (such as a map) in rviz. More...
 
class  PathDisplay
 Displays a nav_2d_msgs::Path2D message in Rviz. More...
 
class  Polygon3DDisplay
 Displays a geometry_msgs::PolygonStamped message in Rviz. More...
 
class  PolygonDisplay
 Displays a nav_2d_msgs::Polygon2DStamped message in Rviz. More...
 
class  PolygonDisplayModeProperty
 Wrapper for EnumProperty + enum for whether to display the outline, area, or both. More...
 
class  PolygonFill
 Constructs a manual ogre object to display the polygon area as a triangle mesh. More...
 
class  PolygonMaterial
 Wrapper that creates a flat semi-transparent Ogre material and gives it a name. More...
 
class  PolygonOutline
 Constructs a manual ogre object to display the polygon outline as a line strip. More...
 
class  PolygonsDisplay
 Displays a nav_2d_msgs::Polygon2DCollection message in Rviz. More...
 
class  Rainbow2Palette
 Rainbow hued palette from red to purple with transparent 0. More...
 
class  RainbowPalette
 Rainbow hued palette from purple to red with transparent 0. More...
 
class  RawPalette
 Same as rviz::MapDisplay raw palette. See https://github.com/ros-visualization/rviz/blob/4b6c0f447159044bfaa633e140e6094b19516b02/src/rviz/default_plugin/map_display.cpp#379. More...
 
class  SpectrumPalette
 Easy class to generate palettes that simply blend two colors together. More...
 

Functions

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. More...
 
bool validateFloats (const nav_grid::NavGridInfo &info)
 
bool validateFloats (const geometry_msgs::Pose2D &pose)
 
bool validateFloats (const nav_2d_msgs::Point2D &point)
 
template<typename T >
bool validateFloats (const std::vector< T > &vec)
 
bool validateFloats (const nav_2d_msgs::Path2D &msg)
 
bool validateFloats (const nav_2d_msgs::Polygon2D &msg)
 
bool validateFloats (const nav_2d_msgs::ComplexPolygon2D &msg)
 

Detailed Description

Several reusable pieces for displaying polygons.

Function Documentation

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.

Parameters
color_propertyColor selector
alpha_propertyOptional alpha selector. If null, alpha is assumed to be 1.0
Returns
std_msgs::ColorRGBA with all four channels in range [0, 1]

Definition at line 43 of file polygon_parts.cpp.

bool robot_nav_rviz_plugins::validateFloats ( const nav_grid::NavGridInfo info)
inline

Definition at line 49 of file validate_floats.h.

bool robot_nav_rviz_plugins::validateFloats ( const geometry_msgs::Pose2D &  pose)
inline

Definition at line 56 of file validate_floats.h.

bool robot_nav_rviz_plugins::validateFloats ( const nav_2d_msgs::Point2D &  point)
inline

Definition at line 63 of file validate_floats.h.

template<typename T >
bool robot_nav_rviz_plugins::validateFloats ( const std::vector< T > &  vec)
inline

Definition at line 69 of file validate_floats.h.

bool robot_nav_rviz_plugins::validateFloats ( const nav_2d_msgs::Path2D &  msg)
inline

Definition at line 78 of file validate_floats.h.

bool robot_nav_rviz_plugins::validateFloats ( const nav_2d_msgs::Polygon2D &  msg)
inline

Definition at line 83 of file validate_floats.h.

bool robot_nav_rviz_plugins::validateFloats ( const nav_2d_msgs::ComplexPolygon2D &  msg)
inline

Definition at line 88 of file validate_floats.h.



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