Public Member Functions | |
| void | image_cb (const sensor_msgs::ImageConstPtr &msg) |
| ImageView (const ros::NodeHandle &nh, const std::string &transport) | |
| ~ImageView () | |
Static Public Member Functions | |
| static void | mouse_cb (int event, int x, int y, int flags, void *param) |
Private Attributes | |
| int | count_ |
| boost::format | filename_format_ |
| boost::mutex | image_mutex_ |
| sensor_msgs::CvBridge | img_bridge_ |
| sensor_msgs::ImageConstPtr | last_msg_ |
| image_transport::Subscriber | sub_ |
| std::string | window_name_ |
Definition at line 62 of file image_view.cpp.
| ImageView::ImageView | ( | const ros::NodeHandle & | nh, | |
| const std::string & | transport | |||
| ) | [inline] |
Definition at line 76 of file image_view.cpp.
| ImageView::~ImageView | ( | ) | [inline] |
Definition at line 103 of file image_view.cpp.
| void ImageView::image_cb | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline] |
Definition at line 108 of file image_view.cpp.
| static void ImageView::mouse_cb | ( | int | event, | |
| int | x, | |||
| int | y, | |||
| int | flags, | |||
| void * | param | |||
| ) | [inline, static] |
Definition at line 147 of file image_view.cpp.
int ImageView::count_ [private] |
Definition at line 73 of file image_view.cpp.
boost::format ImageView::filename_format_ [private] |
Definition at line 72 of file image_view.cpp.
boost::mutex ImageView::image_mutex_ [private] |
Definition at line 69 of file image_view.cpp.
sensor_msgs::CvBridge ImageView::img_bridge_ [private] |
Definition at line 68 of file image_view.cpp.
sensor_msgs::ImageConstPtr ImageView::last_msg_ [private] |
Definition at line 67 of file image_view.cpp.
image_transport::Subscriber ImageView::sub_ [private] |
Definition at line 65 of file image_view.cpp.
std::string ImageView::window_name_ [private] |
Definition at line 71 of file image_view.cpp.