#include <ros/ros.h>#include <cv_bridge/cv_bridge.h>#include <opencv/cv.h>#include <sensor_msgs/image_encodings.h>#include <image_transport/image_transport.h>
Go to the source code of this file.
| Functions | |
| void | doOverlay (const sensor_msgs::ImageConstPtr &img_msg, const sensor_msgs::CameraInfoConstPtr &info_msg) | 
| int | main (int argc, char **argv) | 
| Variables | |
| image_transport::CameraSubscriber | camera_sub | 
| cv_bridge::CvImagePtr | cv_img | 
| image_transport::Publisher | output_pub | 
| void doOverlay | ( | const sensor_msgs::ImageConstPtr & | img_msg, | 
| const sensor_msgs::CameraInfoConstPtr & | info_msg | ||
| ) | 
Definition at line 14 of file ar_servo_image_proc.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 42 of file ar_servo_image_proc.cpp.
Definition at line 10 of file ar_servo_image_proc.cpp.
Definition at line 12 of file ar_servo_image_proc.cpp.
Definition at line 11 of file ar_servo_image_proc.cpp.