Display subclass for subscribing and displaying to image messages. More...
#include <image_display_base.h>

Public Member Functions | |
| ImageDisplayBase () | |
| Constructor. | |
| virtual | ~ImageDisplayBase () |
Protected Slots | |
| void | fillTransportOptionList (EnumProperty *property) |
| Fill list of available and working transport options. | |
| virtual void | updateQueueSize () |
| Update queue size of tf filter. | |
| virtual void | updateTopic () |
| Update topic and resubscribe. | |
Protected Member Functions | |
| void | enableTFFilter (std::string &targetFrame) |
| Enabling TF filtering by defining a target frame. | |
| virtual void | fixedFrameChanged () |
| Called by setFixedFrame(). Override to respond to changes to fixed_frame_. | |
| void | incomingMessage (const sensor_msgs::Image::ConstPtr &msg) |
| Incoming message callback. Checks if the message pointer is valid, increments messages_received_, then calls processMessage(). | |
| virtual void | processMessage (const sensor_msgs::Image::ConstPtr &msg)=0 |
| Implement this to process the contents of a message. | |
| virtual void | reset () |
| Reset display. | |
| void | scanForTransportSubscriberPlugins () |
| virtual void | subscribe () |
| ROS topic management. | |
| virtual void | unsubscribe () |
Protected Attributes | |
| image_transport::ImageTransport | it_ |
| uint32_t | messages_received_ |
| IntProperty * | queue_size_property_ |
| boost::shared_ptr < image_transport::SubscriberFilter > | sub_ |
| std::string | targetFrame_ |
| boost::shared_ptr < tf::MessageFilter < sensor_msgs::Image > > | tf_filter_ |
| RosTopicProperty * | topic_property_ |
| std::string | transport_ |
| std::set< std::string > | transport_plugin_types_ |
| EnumProperty * | transport_property_ |
Display subclass for subscribing and displaying to image messages.
This class brings together some common things used for subscribing and displaying image messages in Display types. It has a tf::MessageFilter and image_tranport::SubscriberFilter to filter incoming image messages, and it handles subscribing and unsubscribing when the display is enabled or disabled.
Definition at line 60 of file image_display_base.h.
Constructor.
Definition at line 45 of file image_display_base.cpp.
| rviz::ImageDisplayBase::~ImageDisplayBase | ( | ) | [virtual] |
Definition at line 75 of file image_display_base.cpp.
| void rviz::ImageDisplayBase::enableTFFilter | ( | std::string & | targetFrame | ) | [inline, protected] |
Enabling TF filtering by defining a target frame.
Definition at line 85 of file image_display_base.h.
| void rviz::ImageDisplayBase::fillTransportOptionList | ( | EnumProperty * | property | ) | [protected, slot] |
Fill list of available and working transport options.
Definition at line 210 of file image_display_base.cpp.
| void rviz::ImageDisplayBase::fixedFrameChanged | ( | ) | [protected, virtual] |
Called by setFixedFrame(). Override to respond to changes to fixed_frame_.
Reimplemented from rviz::Display.
Reimplemented in rviz::CameraDisplay.
Definition at line 161 of file image_display_base.cpp.
| void rviz::ImageDisplayBase::incomingMessage | ( | const sensor_msgs::Image::ConstPtr & | msg | ) | [protected] |
Incoming message callback. Checks if the message pointer is valid, increments messages_received_, then calls processMessage().
Definition at line 80 of file image_display_base.cpp.
| virtual void rviz::ImageDisplayBase::processMessage | ( | const sensor_msgs::Image::ConstPtr & | msg | ) | [protected, pure virtual] |
Implement this to process the contents of a message.
This is called by incomingMessage().
Implemented in rviz::CameraDisplay, and rviz::ImageDisplay.
| void rviz::ImageDisplayBase::reset | ( | ) | [protected, virtual] |
Reset display.
Reimplemented from rviz::Display.
Reimplemented in rviz::CameraDisplay, and rviz::ImageDisplay.
Definition at line 96 of file image_display_base.cpp.
| void rviz::ImageDisplayBase::scanForTransportSubscriberPlugins | ( | ) | [protected] |
Definition at line 170 of file image_display_base.cpp.
| void rviz::ImageDisplayBase::subscribe | ( | ) | [protected, virtual] |
ROS topic management.
Reimplemented in rviz::CameraDisplay.
Definition at line 111 of file image_display_base.cpp.
| void rviz::ImageDisplayBase::unsubscribe | ( | ) | [protected, virtual] |
Reimplemented in rviz::CameraDisplay.
Definition at line 155 of file image_display_base.cpp.
| void rviz::ImageDisplayBase::updateQueueSize | ( | ) | [protected, virtual, slot] |
Update queue size of tf filter.
Reimplemented in rviz::CameraDisplay.
Definition at line 104 of file image_display_base.cpp.
| void rviz::ImageDisplayBase::updateTopic | ( | ) | [protected, virtual, slot] |
Update topic and resubscribe.
Definition at line 202 of file image_display_base.cpp.
Definition at line 109 of file image_display_base.h.
uint32_t rviz::ImageDisplayBase::messages_received_ [protected] |
Definition at line 115 of file image_display_base.h.
IntProperty* rviz::ImageDisplayBase::queue_size_property_ [protected] |
Definition at line 119 of file image_display_base.h.
boost::shared_ptr<image_transport::SubscriberFilter> rviz::ImageDisplayBase::sub_ [protected] |
Definition at line 110 of file image_display_base.h.
std::string rviz::ImageDisplayBase::targetFrame_ [protected] |
Definition at line 113 of file image_display_base.h.
boost::shared_ptr<tf::MessageFilter<sensor_msgs::Image> > rviz::ImageDisplayBase::tf_filter_ [protected] |
Definition at line 111 of file image_display_base.h.
RosTopicProperty* rviz::ImageDisplayBase::topic_property_ [protected] |
Definition at line 117 of file image_display_base.h.
std::string rviz::ImageDisplayBase::transport_ [protected] |
Definition at line 121 of file image_display_base.h.
std::set<std::string> rviz::ImageDisplayBase::transport_plugin_types_ [protected] |
Definition at line 123 of file image_display_base.h.
EnumProperty* rviz::ImageDisplayBase::transport_property_ [protected] |
Definition at line 118 of file image_display_base.h.