Node for displaying images super-imposed to 2D features and stuff. More...
#include <ros/package.h>
#include <ros/ros.h>
#include <ucl_drone/profiling.h>
#include <sensor_msgs/image_encodings.h>
#include <ucl_drone/ProcessedImageMsg.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/nonfree.hpp>
Go to the source code of this file.
Classes | |
class | VisionGui |
Class having one attribute per OpenCV 2D Viewer. More... | |
Variables | |
static const std::string | OPENCV_WINDOW1 = "Keypoints window" |
Name of the window where images are displayed. |
Node for displaying images super-imposed to 2D features and stuff.
Definition in file vision_gui.h.
const std::string OPENCV_WINDOW1 = "Keypoints window" [static] |
Name of the window where images are displayed.
Definition at line 34 of file vision_gui.h.