Public Member Functions | |
| void | imageCb (const sensor_msgs::ImageConstPtr &msg) |
| void | imageCb (const sensor_msgs::ImageConstPtr &msg) |
| ImagePainter () | |
| ImagePainter () | |
| void | screenCb (const geometry_msgs::PointStampedPtr &msg) |
| ~ImagePainter () | |
| ~ImagePainter () | |
Private Attributes | |
| image_transport::Publisher | image_pub_ |
| image_transport::Subscriber | image_sub_ |
| image_transport::ImageTransport | it_ |
| ros::NodeHandle | nh_ |
| ros::Subscriber | screen_sub_ |
| int | screen_x |
| int | screen_y |
Definition at line 14 of file image_painter.cpp.
| ImagePainter::ImagePainter | ( | ) | [inline] |
Definition at line 22 of file image_painter.cpp.
| ImagePainter::~ImagePainter | ( | ) | [inline] |
Definition at line 31 of file image_painter.cpp.
| ImagePainter::ImagePainter | ( | ) | [inline] |
Definition at line 25 of file image_painter2.cpp.
| ImagePainter::~ImagePainter | ( | ) | [inline] |
Definition at line 37 of file image_painter2.cpp.
| void ImagePainter::imageCb | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline] |
Definition at line 36 of file image_painter.cpp.
| void ImagePainter::imageCb | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline] |
Definition at line 48 of file image_painter2.cpp.
| void ImagePainter::screenCb | ( | const geometry_msgs::PointStampedPtr & | msg | ) | [inline] |
Definition at line 42 of file image_painter2.cpp.
Definition at line 19 of file image_painter.cpp.
Definition at line 18 of file image_painter.cpp.
Definition at line 17 of file image_painter.cpp.
ros::NodeHandle ImagePainter::nh_ [private] |
Definition at line 16 of file image_painter.cpp.
ros::Subscriber ImagePainter::screen_sub_ [private] |
Definition at line 21 of file image_painter2.cpp.
int ImagePainter::screen_x [private] |
Definition at line 23 of file image_painter2.cpp.
int ImagePainter::screen_y [private] |
Definition at line 23 of file image_painter2.cpp.