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

Accumulates and displays the pose from a geometry_msgs::PoseStamped message. More...

#include <pose_display.h>

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

List of all members.

Public Types

enum  Shape { Arrow, Axes }

Public Member Functions

virtual void onInitialize ()
 Override this function to do subclass-specific initialization.
 PoseDisplay ()
virtual void reset ()
 Called to tell the display to clear its state.
virtual ~PoseDisplay ()

Protected Member Functions

virtual void onEnable ()
 Overridden from MessageFilterDisplay to get arrow/axes visibility correct.

Private Slots

void updateArrowGeometry ()
void updateAxisGeometry ()
void updateColorAndAlpha ()
void updateShapeChoice ()
void updateShapeVisibility ()

Private Member Functions

void clear ()
virtual void processMessage (const geometry_msgs::PoseStamped::ConstPtr &message)

Private Attributes

FloatPropertyalpha_property_
rviz::Arrow * arrow_
rviz::Axesaxes_
FloatPropertyaxes_length_property_
FloatPropertyaxes_radius_property_
PoseDisplaySelectionHandlerPtr coll_handler_
ColorPropertycolor_property_
FloatPropertyhead_length_property_
FloatPropertyhead_radius_property_
bool pose_valid_
FloatPropertyshaft_length_property_
FloatPropertyshaft_radius_property_
EnumPropertyshape_property_

Friends

class PoseDisplaySelectionHandler

Detailed Description

Accumulates and displays the pose from a geometry_msgs::PoseStamped message.

Definition at line 54 of file pose_display.h.


Member Enumeration Documentation

Enumerator:
Arrow 
Axes 

Definition at line 58 of file pose_display.h.


Constructor & Destructor Documentation

Definition at line 119 of file pose_display.cpp.

Definition at line 181 of file pose_display.cpp.


Member Function Documentation

void rviz::PoseDisplay::clear ( ) [private]
void rviz::PoseDisplay::onEnable ( ) [protected, virtual]

Overridden from MessageFilterDisplay to get arrow/axes visibility correct.

Reimplemented from rviz::MessageFilterDisplay< geometry_msgs::PoseStamped >.

Definition at line 190 of file pose_display.cpp.

void rviz::PoseDisplay::onInitialize ( ) [virtual]

Override this function to do subclass-specific initialization.

This is called after vis_manager_ and scene_manager_ are set, and before load() or setEnabled().

setName() may or may not have been called before this.

Reimplemented from rviz::MessageFilterDisplay< geometry_msgs::PoseStamped >.

Definition at line 156 of file pose_display.cpp.

void rviz::PoseDisplay::processMessage ( const geometry_msgs::PoseStamped::ConstPtr &  message) [private, virtual]

Definition at line 256 of file pose_display.cpp.

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

Called to tell the display to clear its state.

Reimplemented from rviz::MessageFilterDisplay< geometry_msgs::PoseStamped >.

Definition at line 284 of file pose_display.cpp.

void rviz::PoseDisplay::updateArrowGeometry ( ) [private, slot]

Definition at line 206 of file pose_display.cpp.

void rviz::PoseDisplay::updateAxisGeometry ( ) [private, slot]

Definition at line 215 of file pose_display.cpp.

void rviz::PoseDisplay::updateColorAndAlpha ( ) [private, slot]

Definition at line 196 of file pose_display.cpp.

void rviz::PoseDisplay::updateShapeChoice ( ) [private, slot]

Definition at line 222 of file pose_display.cpp.

void rviz::PoseDisplay::updateShapeVisibility ( ) [private, slot]

Definition at line 241 of file pose_display.cpp.


Friends And Related Function Documentation

friend class PoseDisplaySelectionHandler [friend]

Definition at line 104 of file pose_display.h.


Member Data Documentation

Definition at line 94 of file pose_display.h.

rviz::Arrow* rviz::PoseDisplay::arrow_ [private]

Definition at line 86 of file pose_display.h.

Definition at line 87 of file pose_display.h.

Definition at line 101 of file pose_display.h.

Definition at line 102 of file pose_display.h.

Definition at line 89 of file pose_display.h.

Definition at line 93 of file pose_display.h.

Definition at line 97 of file pose_display.h.

Definition at line 96 of file pose_display.h.

Definition at line 88 of file pose_display.h.

Definition at line 99 of file pose_display.h.

Definition at line 98 of file pose_display.h.

Definition at line 91 of file pose_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 Aug 27 2015 15:02:29