#include <ros/ros.h>
#include <image_transport/image_transport.h>
#include <opencv/cv.h>
#include <opencv/highgui.h>
#include <cxcore.h>
#include <cv_bridge/CvBridge.h>
Go to the source code of this file.
Functions | |
void | imageCallback (const sensor_msgs::ImageConstPtr &msg) |
int | main (int argc, char **argv) |
Variables | |
int | corner_count |
const int | g_board_dt = 10 |
int | g_board_h = 6 |
int | g_board_n = g_board_w * g_board_h |
CvSize | g_board_sz = cvSize (g_board_w, g_board_h) |
int | g_board_w = 9 |
int | g_boards_n = 20 |
sensor_msgs::CvBridge | g_bridge |
CvPoint2D32f * | g_corners = new CvPoint2D32f[g_board_n] |
CvMat * | g_distortion_coeffs = cvCreateMat (4, 1, CV_32FC1) |
int | g_frame = 0 |
CvMat * | g_image_points = cvCreateMat (g_boards_n * g_board_n, 2, CV_32FC1) |
IplImage * | g_image_raw = NULL |
CvMat * | g_intrinsic_matrix = cvCreateMat (3, 3, CV_32FC1) |
CvMat * | g_object_points = cvCreateMat (g_boards_n * g_board_n, 3, CV_32FC1) |
CvMat * | g_point_counts = cvCreateMat (g_boards_n, 1, CV_32SC1) |
int | g_step |
int | g_successes = 0 |
void imageCallback | ( | const sensor_msgs::ImageConstPtr & | msg | ) |
Definition at line 63 of file camera_calibration.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 178 of file camera_calibration.cpp.
int corner_count |
Definition at line 56 of file camera_calibration.cpp.
const int g_board_dt = 10 |
Definition at line 41 of file camera_calibration.cpp.
int g_board_h = 6 |
Definition at line 43 of file camera_calibration.cpp.
Definition at line 44 of file camera_calibration.cpp.
CvSize g_board_sz = cvSize (g_board_w, g_board_h) |
Definition at line 45 of file camera_calibration.cpp.
int g_board_w = 9 |
Definition at line 42 of file camera_calibration.cpp.
int g_boards_n = 20 |
Definition at line 40 of file camera_calibration.cpp.
sensor_msgs::CvBridge g_bridge |
Definition at line 60 of file camera_calibration.cpp.
Definition at line 55 of file camera_calibration.cpp.
CvMat* g_distortion_coeffs = cvCreateMat (4, 1, CV_32FC1) |
Definition at line 53 of file camera_calibration.cpp.
int g_frame = 0 |
Definition at line 58 of file camera_calibration.cpp.
CvMat* g_image_points = cvCreateMat (g_boards_n * g_board_n, 2, CV_32FC1) |
Definition at line 48 of file camera_calibration.cpp.
IplImage* g_image_raw = NULL |
Definition at line 61 of file camera_calibration.cpp.
CvMat* g_intrinsic_matrix = cvCreateMat (3, 3, CV_32FC1) |
Definition at line 52 of file camera_calibration.cpp.
CvMat* g_object_points = cvCreateMat (g_boards_n * g_board_n, 3, CV_32FC1) |
Definition at line 49 of file camera_calibration.cpp.
CvMat* g_point_counts = cvCreateMat (g_boards_n, 1, CV_32SC1) |
Definition at line 50 of file camera_calibration.cpp.
int g_step |
Definition at line 58 of file camera_calibration.cpp.
int g_successes = 0 |
Definition at line 57 of file camera_calibration.cpp.