Public Types | Public Member Functions | Private Slots | Private Member Functions | Private Attributes | List of all members
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]

Public Types

enum  Shape { Arrow, Axes }
 
- Public Types inherited from rviz::MessageFilterDisplay< geometry_msgs::PoseArray >
typedef MessageFilterDisplay< MessageType > MFDClass
 

Public Member Functions

virtual void onInitialize ()
 
 PoseArrayDisplay ()
 
virtual void reset ()
 
virtual ~PoseArrayDisplay ()
 
- Public Member Functions inherited from rviz::MessageFilterDisplay< geometry_msgs::PoseArray >
 MessageFilterDisplay ()
 
void onInitialize () override
 
void reset () override
 
void setTopic (const QString &topic, const QString &) override
 
 ~MessageFilterDisplay () override
 
- Public Member Functions inherited from rviz::_RosTopicDisplay
 _RosTopicDisplay ()
 
- Public Member Functions inherited from rviz::Display
virtual void deleteStatus (const QString &name)
 
void deleteStatusStd (const std::string &name)
 
 Display ()
 
void emitTimeSignal (ros::Time time)
 
QWidget * getAssociatedWidget () const
 
PanelDockWidgetgetAssociatedWidgetPanel ()
 
virtual QString getClassId () const
 
Ogre::SceneNode * getSceneNode () const
 
QVariant getViewData (int column, int role) const override
 
Qt::ItemFlags getViewFlags (int column) const override
 
uint32_t getVisibilityBits ()
 
void initialize (DisplayContext *context)
 
bool isEnabled () const
 
void load (const Config &config) override
 
void save (Config config) const override
 
void setAssociatedWidget (QWidget *widget)
 
virtual void setClassId (const QString &class_id)
 
void setFixedFrame (const QString &fixed_frame)
 
void setName (const QString &name) override
 
virtual void setStatus (StatusProperty::Level level, const QString &name, const QString &text)
 
void setStatusStd (StatusProperty::Level level, const std::string &name, const std::string &text)
 
void setVisibilityBits (uint32_t bits)
 
void unsetVisibilityBits (uint32_t bits)
 
virtual void update (float wall_dt, float ros_dt)
 
 ~Display () override
 
- Public Member Functions inherited from rviz::BoolProperty
 BoolProperty (const QString &name, bool default_value, const QString &description, P *parent, Func &&changed_slot)
 
 BoolProperty (const QString &name, bool default_value, const QString &description, Property *parent, Func &&changed_slot, const R *receiver)
 
 BoolProperty (const QString &name=QString(), bool default_value=false, const QString &description=QString(), Property *parent=nullptr)
 
virtual bool getBool () const
 
bool getDisableChildren () override
 
bool getDisableChildrenIfFalse ()
 
void setDisableChildrenIfFalse (bool disable)
 
 ~BoolProperty () override
 
- Public Member Functions inherited from rviz::Property
virtual void addChild (Property *child, int index=-1)
 
PropertychildAt (int index) const
 
virtual PropertychildAtUnchecked (int index) const
 
virtual void collapse ()
 
std::enable_if<!QtPrivate::FunctionPointer< Func >::IsPointerToMemberFunction, QMetaObject::Connection >::type connect (const QObject *context, Func &&slot, Qt::ConnectionType type=Qt::AutoConnection)
 
QMetaObject::Connection connect (const QObject *receiver, const char *slot, Qt::ConnectionType type=Qt::AutoConnection)
 
std::enable_if< QtPrivate::FunctionPointer< Func >::IsPointerToMemberFunction, QMetaObject::Connection >::type connect (const R *receiver, Func &&slot, Qt::ConnectionType type=Qt::AutoConnection)
 
std::enable_if<!QtPrivate::FunctionPointer< Func >::IsPointerToMemberFunction, QMetaObject::Connection >::type connect (Func &&slot, Qt::ConnectionType type=Qt::AutoConnection)
 
bool contains (Property *possible_child) const
 
virtual QWidget * createEditor (QWidget *parent, const QStyleOptionViewItem &option)
 
virtual void expand ()
 
virtual QString getDescription () const
 
virtual bool getHidden () const
 
virtual QIcon getIcon () const
 
PropertyTreeModelgetModel () const
 
virtual QString getName () const
 
std::string getNameStd () const
 
PropertygetParent () const
 
virtual bool getReadOnly () const
 
virtual QVariant getValue () const
 
void hide ()
 
void insertChildSorted (Property *child)
 
bool isAncestorOf (Property *possible_child) const
 
virtual void moveChild (int from_index, int to_index)
 
virtual int numChildren () const
 
virtual bool paint (QPainter *painter, const QStyleOptionViewItem &option) const
 
 Property (const QString &name, const QVariant &default_value, const QString &description, P *parent, Func &&changed_slot)
 
 Property (const QString &name, const QVariant &default_value, const QString &description, Property *parent, Func &&changed_slot, const R *receiver)
 
 Property (const QString &name=QString(), const QVariant &default_value=QVariant(), const QString &description=QString(), Property *parent=nullptr)
 
virtual void removeChildren (int start_index=0, int count=-1)
 
int rowNumberInParent () const
 
virtual void setDescription (const QString &description)
 
virtual void setHidden (bool hidden)
 
virtual void setIcon (const QIcon &icon)
 
void setModel (PropertyTreeModel *model)
 
void setParent (Property *new_parent)
 
virtual void setReadOnly (bool read_only)
 
void setShouldBeSaved (bool save)
 
virtual bool setValue (const QVariant &new_value)
 
bool shouldBeSaved () const
 
void show ()
 
virtual PropertysubProp (const QString &sub_name)
 
PropertytakeChild (Property *child)
 
virtual PropertytakeChildAt (int index)
 
 ~Property () override
 

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_
 

Additional Inherited Members

- Public Slots inherited from rviz::Display
virtual void onEnableChanged ()
 
void queueRender ()
 
void setEnabled (bool enabled)
 
void setIcon (const QIcon &icon) override
 
- Public Slots inherited from rviz::BoolProperty
bool setBool (bool value)
 
- Signals inherited from rviz::Display
void timeSignal (ros::Time time, QPrivateSignal)
 
- Signals inherited from rviz::Property
void aboutToChange ()
 
void changed ()
 
void childListChanged (Property *this_property)
 
- Protected Slots inherited from rviz::_RosTopicDisplay
- Protected Member Functions inherited from rviz::MessageFilterDisplay< geometry_msgs::PoseArray >
void fixedFrameChanged () override
 
void incomingMessage (const typename MessageType::ConstPtr &msg)
 
void onDisable () override
 
void onEnable () override
 
virtual void processMessage (const typename MessageType::ConstPtr &msg)=0
 
void processTypeErasedMessage (boost::shared_ptr< const void > type_erased_msg) override
 
virtual void subscribe ()
 
virtual void unsubscribe ()
 
void updateQueueSize () override
 
void updateTopic () override
 
- Protected Member Functions inherited from rviz::Display
virtual void clearStatuses ()
 
bool initialized () const
 
- Protected Member Functions inherited from rviz::Property
void loadValue (const Config &config)
 
- Protected Attributes inherited from rviz::MessageFilterDisplay< geometry_msgs::PoseArray >
uint32_t messages_received_
 
message_filters::Subscriber< MessageType > sub_
 
tf2_ros::MessageFilter< MessageType > * tf_filter_
 
- Protected Attributes inherited from rviz::_RosTopicDisplay
IntPropertyqueue_size_property_
 
RosTopicPropertytopic_property_
 
BoolPropertyunreliable_property_
 
- Protected Attributes inherited from rviz::Display
DisplayContextcontext_
 
QString fixed_frame_
 
Ogre::SceneManager * scene_manager_
 
Ogre::SceneNode * scene_node_
 
ros::NodeHandle threaded_nh_
 
ros::NodeHandle update_nh_
 
- Protected Attributes inherited from rviz::Property
bool child_indexes_valid_
 
QIcon icon_
 
PropertyTreeModelmodel_
 
QVariant value_
 

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

◆ Shape

Enumerator
Arrow 
Axes 

Definition at line 57 of file pose_array_display.h.

Constructor & Destructor Documentation

◆ PoseArrayDisplay()

jsk_rviz_plugins::PoseArrayDisplay::PoseArrayDisplay ( )

◆ ~PoseArrayDisplay()

virtual jsk_rviz_plugins::PoseArrayDisplay::~PoseArrayDisplay ( )
virtual

Member Function Documentation

◆ allocateCoords

void jsk_rviz_plugins::PoseArrayDisplay::allocateCoords ( int  num)
privateslot

Definition at line 128 of file pose_array_display.cpp.

◆ onInitialize()

virtual void jsk_rviz_plugins::PoseArrayDisplay::onInitialize ( )
virtual

Reimplemented from rviz::Display.

◆ processMessage()

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

◆ reset()

virtual void jsk_rviz_plugins::PoseArrayDisplay::reset ( )
virtual

Reimplemented from rviz::Display.

◆ updateAxisGeometry

void jsk_rviz_plugins::PoseArrayDisplay::updateAxisGeometry ( )
privateslot

Definition at line 120 of file pose_array_display.cpp.

◆ updateShapeChoice

void jsk_rviz_plugins::PoseArrayDisplay::updateShapeChoice ( )
privateslot

◆ updateShapeVisibility

void jsk_rviz_plugins::PoseArrayDisplay::updateShapeVisibility ( )
privateslot

Definition at line 101 of file pose_array_display.cpp.

Member Data Documentation

◆ axes_length_property_

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

Definition at line 81 of file pose_array_display.h.

◆ axes_radius_property_

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

Definition at line 82 of file pose_array_display.h.

◆ color_property_

rviz::ColorProperty* jsk_rviz_plugins::PoseArrayDisplay::color_property_
private

Definition at line 79 of file pose_array_display.h.

◆ coords_nodes_

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

Definition at line 85 of file pose_array_display.h.

◆ coords_objects_

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

Definition at line 84 of file pose_array_display.h.

◆ length_property_

rviz::FloatProperty* jsk_rviz_plugins::PoseArrayDisplay::length_property_
private

Definition at line 80 of file pose_array_display.h.

◆ manual_object_

Ogre::ManualObject* jsk_rviz_plugins::PoseArrayDisplay::manual_object_
private

Definition at line 77 of file pose_array_display.h.

◆ pose_valid_

bool jsk_rviz_plugins::PoseArrayDisplay::pose_valid_
private

Definition at line 87 of file pose_array_display.h.

◆ shape_property_

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 Mon Jan 22 2024 03:47:13