Public Member Functions | |
| ClickableDisplay () | |
| void | imgCallback (const sensor_msgs::ImageConstPtr &img_msg) |
| void | onInit () |
| void | showImg () |
| ~ClickableDisplay () | |
Static Public Member Functions | |
| static void | mouseClickCallback (int event, int x, int y, int flags, void *data) |
Public Attributes | |
| image_transport::Subscriber | camera_sub |
| bool | have_img |
| std::string | img_frame |
| cv_bridge::CvImagePtr | img_ptr |
| image_transport::ImageTransport | img_trans |
| ros::Publisher | l_click_pub |
| ros::NodeHandle | nh |
| ros::NodeHandle | nh_priv |
| ros::Publisher | r_click_pub |
Definition at line 18 of file clickable_display.cpp.
Definition at line 37 of file clickable_display.cpp.
Definition at line 98 of file clickable_display.cpp.
| void ClickableDisplay::imgCallback | ( | const sensor_msgs::ImageConstPtr & | img_msg | ) |
Definition at line 56 of file clickable_display.cpp.
| void ClickableDisplay::mouseClickCallback | ( | int | event, |
| int | x, | ||
| int | y, | ||
| int | flags, | ||
| void * | data | ||
| ) | [static] |
Definition at line 80 of file clickable_display.cpp.
| void ClickableDisplay::onInit | ( | ) |
Definition at line 42 of file clickable_display.cpp.
| void ClickableDisplay::showImg | ( | ) |
Definition at line 68 of file clickable_display.cpp.
Definition at line 22 of file clickable_display.cpp.
Definition at line 26 of file clickable_display.cpp.
| std::string hrl_clickable_world::ClickableDisplay::img_frame |
Definition at line 24 of file clickable_display.cpp.
Definition at line 25 of file clickable_display.cpp.
Definition at line 21 of file clickable_display.cpp.
Definition at line 23 of file clickable_display.cpp.
Definition at line 20 of file clickable_display.cpp.
Definition at line 20 of file clickable_display.cpp.
Definition at line 23 of file clickable_display.cpp.