Computer vision header file. More...
#include <ucl_drone/profiling.h>
#include <boost/shared_ptr.hpp>
#include <ros/package.h>
#include <ros/ros.h>
#include <ucl_drone/ucl_drone.h>
#include <cv_bridge/cv_bridge.h>
#include <image_transport/image_transport.h>
#include <opencv2/calib3d/calib3d.hpp>
#include <opencv2/core/core.hpp>
#include <opencv2/highgui/highgui.hpp>
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/nonfree/features2d.hpp>
#include <opencv2/nonfree/gpu.hpp>
#include <opencv2/nonfree/nonfree.hpp>
#include <opencv2/nonfree/ocl.hpp>
#include <opencv2/ocl/ocl.hpp>
#include <opencv2/video/tracking.hpp>
#include <ardrone_autonomy/CamSelect.h>
#include <ardrone_autonomy/Navdata.h>
#include <sensor_msgs/image_encodings.h>
#include <std_msgs/Empty.h>
#include <std_srvs/Empty.h>
#include <ucl_drone/Pose3D.h>
#include <ucl_drone/ProcessedImageMsg.h>
#include <ucl_drone/opencv_utils.h>
#include <ucl_drone/map/projection_2D.h>
#include <ucl_drone/computer_vision/target.h>
#include <ucl_drone/computer_vision/processed_image.h>
#include <ucl_drone/computer_vision/image_processor.h>
Go to the source code of this file.
Defines | |
#define | PCL_NO_PRECOMPILE |
Functions | |
static const cv::SIFT | detector (0, 3, 0.1, 15, 2) |
Variables | |
static const cv::SiftDescriptorExtractor | extractor |
Computer vision header file.
Part of ucl_drone. Computer vision ROS node. Contains:
Definition in file computer_vision.h.
#define PCL_NO_PRECOMPILE |
Definition at line 15 of file computer_vision.h.
static const cv::SIFT detector | ( | 0 | , |
3 | , | ||
0. | 1, | ||
15 | , | ||
2 | |||
) | [static] |
const cv::SiftDescriptorExtractor extractor [static] |
Definition at line 76 of file computer_vision.h.