cameraParameters.h
Go to the documentation of this file.
00001 #ifndef camera_parameters_h
00002 #define camera_parameters_h
00003 
00004 #include <opencv/cv.h>
00005 #include <sensor_msgs/Image.h>
00006 
00007 #include <opencv2/core/core.hpp>
00008 #include <opencv2/highgui/highgui.hpp>
00009 #include <opencv2/imgproc/imgproc.hpp>
00010 #include <opencv2/features2d/features2d.hpp>
00011 #include "opencv2/contrib/contrib.hpp"
00012 #include "opencv2/calib3d/calib3d.hpp"
00013 
00014 #include <cv_bridge/CvBridge.h>
00015 
00016 const int imageWidth = 744;
00017 const int imageHeight = 480;
00018 
00019 double kArray[9] = {4.177343016733e+002, 0, 3.715643918956e+002, 
00020                     0, 4.177970397634e+002, 1.960688121183e+002, 
00021                     0, 0, 1};
00022 
00023 double dArray[4] = {-3.396867101163e-001, 1.309347902588e-001, -2.346791258754e-004, 2.209387016957e-004};
00024 
00025 #endif
00026 


demo_lidar
Author(s): Ji Zhang
autogenerated on Fri Jan 3 2014 11:17:39