Public Member Functions | Protected Slots | Protected Member Functions | Protected Attributes | List of all members
rqt_image_view::ImageView Class Reference

#include <image_view.h>

Inheritance diagram for rqt_image_view::ImageView:
Inheritance graph
[legend]

Public Member Functions

virtual bool eventFilter (QObject *watched, QEvent *event)
 
 ImageView ()
 
virtual void initPlugin (qt_gui_cpp::PluginContext &context)
 
virtual void restoreSettings (const qt_gui_cpp::Settings &plugin_settings, const qt_gui_cpp::Settings &instance_settings)
 
virtual void saveSettings (qt_gui_cpp::Settings &plugin_settings, qt_gui_cpp::Settings &instance_settings) const
 
virtual void shutdownPlugin ()
 
- Public Member Functions inherited from rqt_gui_cpp::Plugin
 Plugin ()
 
- Public Member Functions inherited from qt_gui_cpp::Plugin
virtual bool hasConfiguration () const
 
 Plugin ()
 
virtual void triggerConfiguration ()
 
- Public Member Functions inherited from nodelet::Nodelet
void init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)
 
 Nodelet ()
 
virtual ~Nodelet ()
 

Protected Slots

virtual void onDynamicRange (bool checked)
 
virtual void onTopicChanged (int index)
 
virtual void onZoom1 (bool checked)
 
virtual void updateTopicList ()
 

Protected Member Functions

virtual void callbackImage (const sensor_msgs::Image::ConstPtr &msg)
 
virtual QList< QString > getTopicList (const QSet< QString > &message_types, const QList< QString > &transports)
 
virtual void selectTopic (const QString &topic)
 
- Protected Member Functions inherited from nodelet::Nodelet
ros::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::string & getName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Protected Attributes

cv::Mat conversion_mat_
 
QImage qimage_
 
QMutex qimage_mutex_
 
image_transport::Subscriber subscriber_
 
Ui::ImageViewWidget ui_
 
QWidget * widget_
 

Detailed Description

Definition at line 56 of file image_view.h.

Constructor & Destructor Documentation

rqt_image_view::ImageView::ImageView ( )

Definition at line 47 of file image_view.cpp.

Member Function Documentation

void rqt_image_view::ImageView::callbackImage ( const sensor_msgs::Image::ConstPtr &  msg)
protectedvirtual

Definition at line 273 of file image_view.cpp.

bool rqt_image_view::ImageView::eventFilter ( QObject *  watched,
QEvent *  event 
)
virtual

Definition at line 80 of file image_view.cpp.

QList< QString > rqt_image_view::ImageView::getTopicList ( const QSet< QString > &  message_types,
const QList< QString > &  transports 
)
protectedvirtual

Definition at line 179 of file image_view.cpp.

void rqt_image_view::ImageView::initPlugin ( qt_gui_cpp::PluginContext context)
virtual

Reimplemented from qt_gui_cpp::Plugin.

Definition at line 54 of file image_view.cpp.

void rqt_image_view::ImageView::onDynamicRange ( bool  checked)
protectedvirtualslot

Definition at line 268 of file image_view.cpp.

void rqt_image_view::ImageView::onTopicChanged ( int  index)
protectedvirtualslot

Definition at line 226 of file image_view.cpp.

void rqt_image_view::ImageView::onZoom1 ( bool  checked)
protectedvirtualslot

Definition at line 251 of file image_view.cpp.

void rqt_image_view::ImageView::restoreSettings ( const qt_gui_cpp::Settings plugin_settings,
const qt_gui_cpp::Settings instance_settings 
)
virtual

Reimplemented from qt_gui_cpp::Plugin.

Definition at line 122 of file image_view.cpp.

void rqt_image_view::ImageView::saveSettings ( qt_gui_cpp::Settings plugin_settings,
qt_gui_cpp::Settings instance_settings 
) const
virtual

Reimplemented from qt_gui_cpp::Plugin.

Definition at line 112 of file image_view.cpp.

void rqt_image_view::ImageView::selectTopic ( const QString &  topic)
protectedvirtual

Definition at line 216 of file image_view.cpp.

void rqt_image_view::ImageView::shutdownPlugin ( )
virtual

Reimplemented from rqt_gui_cpp::Plugin.

Definition at line 107 of file image_view.cpp.

void rqt_image_view::ImageView::updateTopicList ( )
protectedvirtualslot

Definition at line 138 of file image_view.cpp.

Member Data Documentation

cv::Mat rqt_image_view::ImageView::conversion_mat_
protected

Definition at line 107 of file image_view.h.

QImage rqt_image_view::ImageView::qimage_
protected

Definition at line 104 of file image_view.h.

QMutex rqt_image_view::ImageView::qimage_mutex_
protected

Definition at line 105 of file image_view.h.

image_transport::Subscriber rqt_image_view::ImageView::subscriber_
protected

Definition at line 102 of file image_view.h.

Ui::ImageViewWidget rqt_image_view::ImageView::ui_
protected

Definition at line 98 of file image_view.h.

QWidget* rqt_image_view::ImageView::widget_
protected

Definition at line 100 of file image_view.h.


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


hector_rqt_plugins
Author(s): Dirk Thomas, Thorsten Graber, Gregor Gebhardt
autogenerated on Mon Jun 10 2019 13:36:34