Public Types | Public Member Functions | Protected Member Functions | Protected Attributes
rviz::MessageFilterJointStateDisplay Class Reference

Display subclass using a tf::MessageFilter, templated on the ROS message type. More...

#include <effort_display.h>

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

List of all members.

Public Types

typedef
MessageFilterJointStateDisplay 
MFDClass
 Convenience typedef so subclasses don't have to use the long templated class name to refer to their super class.

Public Member Functions

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

Protected Member Functions

virtual void fixedFrameChanged ()
 Called by setFixedFrame(). Override to respond to changes to fixed_frame_.
void incomingMessage (const typename sensor_msgs::JointState::ConstPtr &msg)
 Incoming message callback. Checks if the message pointer is valid, increments messages_received_, then calls processMessage().
virtual void onDisable ()
 Derived classes override this to do the actual work of disabling themselves.
virtual void onEnable ()
 Derived classes override this to do the actual work of enabling themselves.
virtual void processMessage (const typename sensor_msgs::JointState::ConstPtr &msg)=0
 Implement this to process the contents of a message.
virtual void subscribe ()
virtual void unsubscribe ()
virtual void updateTopic ()

Protected Attributes

uint32_t messages_received_
message_filters::Subscriber
< sensor_msgs::JointState > 
sub_
tf::MessageFilterJointStatetf_filter_

Detailed Description

Display subclass using a tf::MessageFilter, templated on the ROS message type.

This class brings together some common things used in many Display types. It has a tf::MessageFilter to filter incoming messages, and it handles subscribing and unsubscribing when the display is enabled or disabled. It also has an Ogre::SceneNode which

Definition at line 512 of file effort_display.h.


Member Typedef Documentation

Convenience typedef so subclasses don't have to use the long templated class name to refer to their super class.

Definition at line 518 of file effort_display.h.


Constructor & Destructor Documentation

Definition at line 520 of file effort_display.h.

Definition at line 539 of file effort_display.h.


Member Function Documentation

virtual void rviz::MessageFilterJointStateDisplay::fixedFrameChanged ( ) [inline, protected, virtual]

Called by setFixedFrame(). Override to respond to changes to fixed_frame_.

Reimplemented from rviz::Display.

Definition at line 595 of file effort_display.h.

void rviz::MessageFilterJointStateDisplay::incomingMessage ( const typename sensor_msgs::JointState::ConstPtr &  msg) [inline, protected]

Incoming message callback. Checks if the message pointer is valid, increments messages_received_, then calls processMessage().

Definition at line 604 of file effort_display.h.

virtual void rviz::MessageFilterJointStateDisplay::onDisable ( ) [inline, protected, virtual]

Derived classes override this to do the actual work of disabling themselves.

Reimplemented from rviz::Display.

Reimplemented in rviz::EffortDisplay.

Definition at line 589 of file effort_display.h.

virtual void rviz::MessageFilterJointStateDisplay::onEnable ( ) [inline, protected, virtual]

Derived classes override this to do the actual work of enabling themselves.

Reimplemented from rviz::Display.

Reimplemented in rviz::EffortDisplay.

Definition at line 584 of file effort_display.h.

virtual void rviz::MessageFilterJointStateDisplay::onInitialize ( ) [inline, 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::Display.

Reimplemented in rviz::EffortDisplay.

Definition at line 529 of file effort_display.h.

virtual void rviz::MessageFilterJointStateDisplay::processMessage ( const typename sensor_msgs::JointState::ConstPtr &  msg) [protected, pure virtual]

Implement this to process the contents of a message.

This is called by incomingMessage().

virtual void rviz::MessageFilterJointStateDisplay::reset ( ) [inline, virtual]

Called to tell the display to clear its state.

Reimplemented from rviz::Display.

Reimplemented in rviz::EffortDisplay.

Definition at line 545 of file effort_display.h.

virtual void rviz::MessageFilterJointStateDisplay::subscribe ( ) [inline, protected, virtual]

Definition at line 561 of file effort_display.h.

virtual void rviz::MessageFilterJointStateDisplay::unsubscribe ( ) [inline, protected, virtual]

Definition at line 579 of file effort_display.h.

virtual void rviz::MessageFilterJointStateDisplay::updateTopic ( ) [inline, protected, virtual]

Implements rviz::_RosTopicDisplay.

Definition at line 553 of file effort_display.h.


Member Data Documentation

Definition at line 624 of file effort_display.h.

Definition at line 622 of file effort_display.h.

Definition at line 623 of file effort_display.h.


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


rviz
Author(s): Dave Hershberger, David Gossow, Josh Faust
autogenerated on Mon Oct 6 2014 07:26:37