Public Types | Public Member Functions | Private Slots | Private Member Functions | Private Attributes
jsk_rviz_plugins::PoseArrayDisplay Class Reference

Displays a geometry_msgs/PoseArray message as a bunch of line-drawn arrows. More...

#include <pose_array_display.h>

Inheritance diagram for jsk_rviz_plugins::PoseArrayDisplay:
Inheritance graph
[legend]

List of all members.

Public Types

enum  Shape { Arrow, Axes }

Public Member Functions

virtual void onInitialize ()
 PoseArrayDisplay ()
virtual void reset ()
virtual ~PoseArrayDisplay ()

Private Slots

void allocateCoords (int num)
void updateAxisGeometry ()
void updateShapeChoice ()
void updateShapeVisibility ()

Private Member Functions

virtual void processMessage (const geometry_msgs::PoseArray::ConstPtr &msg)

Private Attributes

rviz::FloatPropertyaxes_length_property_
rviz::FloatPropertyaxes_radius_property_
rviz::ColorPropertycolor_property_
std::vector< Ogre::SceneNode * > coords_nodes_
std::vector< rviz::Axes * > coords_objects_
rviz::FloatPropertylength_property_
Ogre::ManualObject * manual_object_
bool pose_valid_
rviz::EnumPropertyshape_property_

Detailed Description

Displays a geometry_msgs/PoseArray message as a bunch of line-drawn arrows.

Definition at line 53 of file pose_array_display.h.


Member Enumeration Documentation

Enumerator:
Arrow 
Axes 

Definition at line 57 of file pose_array_display.h.


Constructor & Destructor Documentation


Member Function Documentation

void jsk_rviz_plugins::PoseArrayDisplay::allocateCoords ( int  num) [private, slot]

Definition at line 125 of file pose_array_display.cpp.

virtual void jsk_rviz_plugins::PoseArrayDisplay::processMessage ( const geometry_msgs::PoseArray::ConstPtr &  msg) [private, virtual]
virtual void jsk_rviz_plugins::PoseArrayDisplay::reset ( ) [virtual]
void jsk_rviz_plugins::PoseArrayDisplay::updateAxisGeometry ( ) [private, slot]

Definition at line 117 of file pose_array_display.cpp.

void jsk_rviz_plugins::PoseArrayDisplay::updateShapeChoice ( ) [private, slot]

Definition at line 83 of file pose_array_display.cpp.

void jsk_rviz_plugins::PoseArrayDisplay::updateShapeVisibility ( ) [private, slot]

Definition at line 98 of file pose_array_display.cpp.


Member Data Documentation

rviz::FloatProperty* jsk_rviz_plugins::PoseArrayDisplay::axes_length_property_ [private]

Definition at line 81 of file pose_array_display.h.

rviz::FloatProperty* jsk_rviz_plugins::PoseArrayDisplay::axes_radius_property_ [private]

Definition at line 82 of file pose_array_display.h.

Definition at line 79 of file pose_array_display.h.

std::vector<Ogre::SceneNode*> jsk_rviz_plugins::PoseArrayDisplay::coords_nodes_ [private]

Definition at line 85 of file pose_array_display.h.

std::vector<rviz::Axes*> jsk_rviz_plugins::PoseArrayDisplay::coords_objects_ [private]

Definition at line 84 of file pose_array_display.h.

Definition at line 80 of file pose_array_display.h.

Definition at line 77 of file pose_array_display.h.

bool jsk_rviz_plugins::PoseArrayDisplay::pose_valid_ [private]

Definition at line 87 of file pose_array_display.h.

rviz::EnumProperty* jsk_rviz_plugins::PoseArrayDisplay::shape_property_ [private]

Definition at line 83 of file pose_array_display.h.


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


jsk_rviz_plugins
Author(s): Kei Okada , Yohei Kakiuchi , Shohei Fujii , Ryohei Ueda
autogenerated on Wed May 1 2019 02:40:22