Public Member Functions | Protected Member Functions | Private Types | Private Slots | Private Member Functions | Private Attributes
rviz::PathDisplay Class Reference

Displays a nav_msgs::Path message. More...

#include <path_display.h>

Inheritance diagram for rviz::PathDisplay:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 PathDisplay ()
virtual void reset ()
 Overridden from Display.
virtual ~PathDisplay ()

Protected Member Functions

virtual void onInitialize ()
 Overridden from Display.
void processMessage (const nav_msgs::Path::ConstPtr &msg)
 Overridden from MessageFilterDisplay.

Private Types

enum  LineStyle { LINES, BILLBOARDS }
enum  PoseStyle { NONE, AXES, ARROWS }

Private Slots

void updateBufferLength ()
void updateLineWidth ()
void updateOffset ()
void updatePoseArrowColor ()
void updatePoseArrowGeometry ()
void updatePoseAxisGeometry ()
void updatePoseStyle ()
void updateStyle ()

Private Member Functions

void allocateArrowVector (std::vector< rviz::Arrow * > &arrow_vect, int num)
void allocateAxesVector (std::vector< rviz::Axes * > &axes_vect, int num)
void destroyObjects ()
void destroyPoseArrowChain ()
void destroyPoseAxesChain ()

Private Attributes

FloatPropertyalpha_property_
std::vector< std::vector
< rviz::Arrow * > > 
arrow_chain_
std::vector< std::vector
< rviz::Axes * > > 
axes_chain_
std::vector
< rviz::BillboardLine * > 
billboard_lines_
IntPropertybuffer_length_property_
ColorPropertycolor_property_
FloatPropertyline_width_property_
std::vector< Ogre::ManualObject * > manual_objects_
VectorPropertyoffset_property_
ColorPropertypose_arrow_color_property_
FloatPropertypose_arrow_head_diameter_property_
FloatPropertypose_arrow_head_length_property_
FloatPropertypose_arrow_shaft_diameter_property_
FloatPropertypose_arrow_shaft_length_property_
FloatPropertypose_axes_length_property_
FloatPropertypose_axes_radius_property_
EnumPropertypose_style_property_
EnumPropertystyle_property_

Detailed Description

Displays a nav_msgs::Path message.

Definition at line 60 of file path_display.h.


Member Enumeration Documentation

Enumerator:
LINES 
BILLBOARDS 

Definition at line 106 of file path_display.h.

Enumerator:
NONE 
AXES 
ARROWS 

Definition at line 121 of file path_display.h.


Constructor & Destructor Documentation

Definition at line 55 of file path_display.cpp.

Definition at line 128 of file path_display.cpp.


Member Function Documentation

void rviz::PathDisplay::allocateArrowVector ( std::vector< rviz::Arrow * > &  arrow_vect,
int  num 
) [private]

Definition at line 166 of file path_display.cpp.

void rviz::PathDisplay::allocateAxesVector ( std::vector< rviz::Axes * > &  axes_vect,
int  num 
) [private]

Definition at line 148 of file path_display.cpp.

Definition at line 320 of file path_display.cpp.

Definition at line 191 of file path_display.cpp.

Definition at line 182 of file path_display.cpp.

void rviz::PathDisplay::onInitialize ( ) [protected, virtual]

Overridden from Display.

Reimplemented from rviz::MessageFilterDisplay< nav_msgs::Path >.

Definition at line 135 of file path_display.cpp.

void rviz::PathDisplay::processMessage ( const nav_msgs::Path::ConstPtr &  msg) [protected]

Overridden from MessageFilterDisplay.

Definition at line 396 of file path_display.cpp.

void rviz::PathDisplay::reset ( ) [virtual]

Overridden from Display.

Reimplemented from rviz::MessageFilterDisplay< nav_msgs::Path >.

Definition at line 141 of file path_display.cpp.

void rviz::PathDisplay::updateBufferLength ( ) [private, slot]

Definition at line 346 of file path_display.cpp.

void rviz::PathDisplay::updateLineWidth ( ) [private, slot]

Definition at line 219 of file path_display.cpp.

void rviz::PathDisplay::updateOffset ( ) [private, slot]

Definition at line 234 of file path_display.cpp.

void rviz::PathDisplay::updatePoseArrowColor ( ) [private, slot]

Definition at line 289 of file path_display.cpp.

Definition at line 304 of file path_display.cpp.

Definition at line 275 of file path_display.cpp.

void rviz::PathDisplay::updatePoseStyle ( ) [private, slot]

Definition at line 240 of file path_display.cpp.

void rviz::PathDisplay::updateStyle ( ) [private, slot]

Definition at line 200 of file path_display.cpp.


Member Data Documentation

Definition at line 101 of file path_display.h.

std::vector<std::vector<rviz::Arrow*> > rviz::PathDisplay::arrow_chain_ [private]

Definition at line 97 of file path_display.h.

std::vector<std::vector<rviz::Axes*> > rviz::PathDisplay::axes_chain_ [private]

Definition at line 96 of file path_display.h.

Definition at line 95 of file path_display.h.

Definition at line 103 of file path_display.h.

Definition at line 100 of file path_display.h.

Definition at line 102 of file path_display.h.

std::vector<Ogre::ManualObject*> rviz::PathDisplay::manual_objects_ [private]

Definition at line 94 of file path_display.h.

Definition at line 104 of file path_display.h.

Definition at line 115 of file path_display.h.

Definition at line 119 of file path_display.h.

Definition at line 117 of file path_display.h.

Definition at line 118 of file path_display.h.

Definition at line 116 of file path_display.h.

Definition at line 113 of file path_display.h.

Definition at line 114 of file path_display.h.

Definition at line 112 of file path_display.h.

Definition at line 99 of file path_display.h.


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


rviz
Author(s): Dave Hershberger, David Gossow, Josh Faust
autogenerated on Thu Jun 6 2019 18:02:17