#include <zbargui.h>

Public Slots | |
| void | doQuit () | 
| void | doStart () | 
| void | SLT_updateImage (const IplImage *pIplImage) | 
| void | SLT_updateImage2 (const IplImage *pIplImage) | 
Signals | |
| void | SIG_updateImage (const IplImage *) | 
| void | SIG_updateImage2 (const IplImage *) | 
Public Member Functions | |
| void | cameraDisplay (const sensor_msgs::ImageConstPtr &msg_ptr) | 
| zbarGui (QWidget *parent=0) | |
| ~zbarGui () | |
Public Attributes | |
| sensor_msgs::CvBridge | bridge_ | 
| ros::ServiceClient | client | 
| image_transport::Subscriber | image_sub_ | 
| ros::NodeHandle | n_ | 
| ros::Subscriber | uvc_sub | 
| zbarGui::zbarGui | ( | QWidget * | parent = 0 | ) |  [explicit] | 
        
Definition at line 9 of file zbargui.cpp.
Definition at line 22 of file zbargui.cpp.
| void zbarGui::cameraDisplay | ( | const sensor_msgs::ImageConstPtr & | msg_ptr | ) | 
Definition at line 65 of file zbargui.cpp.
| void zbarGui::doQuit | ( | ) |  [slot] | 
        
Definition at line 60 of file zbargui.cpp.
| void zbarGui::doStart | ( | ) |  [slot] | 
        
Definition at line 27 of file zbargui.cpp.
| void zbarGui::SIG_updateImage | ( | const IplImage * | ) |  [signal] | 
        
| void zbarGui::SIG_updateImage2 | ( | const IplImage * | ) |  [signal] | 
        
| void zbarGui::SLT_updateImage | ( | const IplImage * | pIplImage | ) |  [slot] | 
        
Definition at line 80 of file zbargui.cpp.
| void zbarGui::SLT_updateImage2 | ( | const IplImage * | pIplImage | ) |  [slot] | 
        
Definition at line 93 of file zbargui.cpp.