#include <opencv/cv.h>
#include <sensor_msgs/Image.h>
#include <opencv2/core/core.hpp>
#include <opencv2/highgui/highgui.hpp>
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/features2d/features2d.hpp>
#include "opencv2/contrib/contrib.hpp"
#include "opencv2/calib3d/calib3d.hpp"
#include <cv_bridge/cv_bridge.h>
Go to the source code of this file.
Variables | |
const int | imageHeight = 480 |
const int | imageWidth = 640 |
double | kDepth [9] = {525.0, 0.0, 319.5, 0.0, 525.0, 239.5, 0.0, 0.0, 1.0} |
double | kImage [9] = {525.0, 0.0, 319.5, 0.0, 525.0, 239.5, 0.0, 0.0, 1.0} |
const int imageHeight = 480 |
Definition at line 17 of file cameraParameters.h.
const int imageWidth = 640 |
Definition at line 16 of file cameraParameters.h.
double kDepth[9] = {525.0, 0.0, 319.5, 0.0, 525.0, 239.5, 0.0, 0.0, 1.0} |
Definition at line 21 of file cameraParameters.h.
double kImage[9] = {525.0, 0.0, 319.5, 0.0, 525.0, 239.5, 0.0, 0.0, 1.0} |
Definition at line 19 of file cameraParameters.h.