#include <ros/ros.h>
#include <sensor_msgs/CameraInfo.h>
Go to the source code of this file.
Namespaces |
namespace | robot_calibration |
| Calibration code lives under this namespace.
|
Enumerations |
enum | { robot_calibration::CAMERA_INFO_P_FX_INDEX = 0,
robot_calibration::CAMERA_INFO_P_FY_INDEX = 5,
robot_calibration::CAMERA_INFO_P_CX_INDEX = 2,
robot_calibration::CAMERA_INFO_P_CY_INDEX = 6
} |
enum | { robot_calibration::CAMERA_INFO_K_FX_INDEX = 0,
robot_calibration::CAMERA_INFO_K_FY_INDEX = 4,
robot_calibration::CAMERA_INFO_K_CX_INDEX = 2,
robot_calibration::CAMERA_INFO_K_CY_INDEX = 5
} |
enum | {
robot_calibration::CAMERA_INFO_D_1 = 0,
robot_calibration::CAMERA_INFO_D_2 = 1,
robot_calibration::CAMERA_INFO_D_3 = 2,
robot_calibration::CAMERA_INFO_D_4 = 3,
robot_calibration::CAMERA_INFO_D_5 = 4
} |
enum | {
robot_calibration::CAMERA_PARAMS_CX_INDEX = 0,
robot_calibration::CAMERA_PARAMS_CY_INDEX = 1,
robot_calibration::CAMERA_PARAMS_FX_INDEX = 2,
robot_calibration::CAMERA_PARAMS_FY_INDEX = 3,
robot_calibration::CAMERA_PARAMS_Z_SCALE_INDEX = 4,
robot_calibration::CAMERA_PARAMS_Z_OFFSET_INDEX = 5
} |
Functions |
sensor_msgs::CameraInfo | robot_calibration::updateCameraInfo (double camera_fx, double camera_fy, double camera_cx, double camera_cy, const sensor_msgs::CameraInfo &info) |
| Update the camera calibration with the new offsets.
|