#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 | |
| double | dImage [4] = {-3.396867101163e-001, 1.309347902588e-001, -2.346791258754e-004, 2.209387016957e-004} | 
| const int | imageHeight = 480 | 
| const int | imageWidth = 744 | 
| double | kImage [9] | 
| double dImage[4] = {-3.396867101163e-001, 1.309347902588e-001, -2.346791258754e-004, 2.209387016957e-004} | 
Definition at line 23 of file cameraParameters.h.
| const int imageHeight = 480 | 
Definition at line 17 of file cameraParameters.h.
| const int imageWidth = 744 | 
Definition at line 16 of file cameraParameters.h.
| double kImage[9] | 
 {4.177343016733e+002, 0, 3.715643918956e+002, 
                    0, 4.177970397634e+002, 1.960688121183e+002, 
                    0, 0, 1}
Definition at line 19 of file cameraParameters.h.