Public Member Functions | |
ImagePublisher (ros::NodeHandle &n) | |
int | mainloop () |
~ImagePublisher () | |
Protected Attributes | |
sensor_msgs::CvBridge | bridge_ |
IplImage * | cv_image |
sensor_msgs::Image | image |
message_transport::Publisher | image_pub_ |
message_transport::MessageTransport < sensor_msgs::Image > | it_ |
ros::NodeHandle | n_ |
Definition at line 8 of file publisher.cpp.
ImagePublisher::ImagePublisher | ( | ros::NodeHandle & | n | ) | [inline] |
Definition at line 20 of file publisher.cpp.
ImagePublisher::~ImagePublisher | ( | ) | [inline] |
Definition at line 31 of file publisher.cpp.
int ImagePublisher::mainloop | ( | ) | [inline] |
Definition at line 35 of file publisher.cpp.
sensor_msgs::CvBridge ImagePublisher::bridge_ [protected] |
Definition at line 12 of file publisher.cpp.
IplImage* ImagePublisher::cv_image [protected] |
Definition at line 14 of file publisher.cpp.
sensor_msgs::Image ImagePublisher::image [protected] |
Definition at line 15 of file publisher.cpp.
message_transport::Publisher ImagePublisher::image_pub_ [protected] |
Definition at line 13 of file publisher.cpp.
message_transport::MessageTransport<sensor_msgs::Image> ImagePublisher::it_ [protected] |
Definition at line 11 of file publisher.cpp.
ros::NodeHandle ImagePublisher::n_ [protected] |
Definition at line 10 of file publisher.cpp.