Public Member Functions | |
ImagePublisher (ros::NodeHandle &n) | |
int | mainloop () |
~ImagePublisher () | |
Protected Attributes | |
cv_bridge::CvImagePtr | cv_ptr |
sensor_msgs::Image | image |
message_transport::Publisher | image_pub_ |
message_transport::MessageTransport < sensor_msgs::Image > | it_ |
ros::NodeHandle | n_ |
Definition at line 6 of file publisher.cpp.
ImagePublisher::ImagePublisher | ( | ros::NodeHandle & | n | ) | [inline] |
Definition at line 19 of file publisher.cpp.
ImagePublisher::~ImagePublisher | ( | ) | [inline] |
Definition at line 28 of file publisher.cpp.
int ImagePublisher::mainloop | ( | ) | [inline] |
Definition at line 32 of file publisher.cpp.
cv_bridge::CvImagePtr ImagePublisher::cv_ptr [protected] |
Definition at line 12 of file publisher.cpp.
sensor_msgs::Image ImagePublisher::image [protected] |
Definition at line 14 of file publisher.cpp.
Definition at line 13 of file publisher.cpp.
message_transport::MessageTransport<sensor_msgs::Image> ImagePublisher::it_ [protected] |
Definition at line 10 of file publisher.cpp.
ros::NodeHandle ImagePublisher::n_ [protected] |
Definition at line 9 of file publisher.cpp.