18 #ifndef IVT_BRIDGE_IVT_CALIBRATION_H    19 #define IVT_BRIDGE_IVT_CALIBRATION_H    21 #include <sensor_msgs/CameraInfo.h>    24 #include <Calibration/Calibration.h>    25 #include <Calibration/StereoCalibration.h>    27 #include <opencv2/core/core.hpp>    76         bool fromCameraInfo(
const sensor_msgs::CameraInfo& left, 
const sensor_msgs::CameraInfo& right);
    81         bool fromCameraInfo(
const sensor_msgs::CameraInfoConstPtr& left, 
const sensor_msgs::CameraInfoConstPtr& right);
 
image_geometry::PinholeCameraModel cam_model
boost::shared_ptr< CCalibration > getCalibration(bool forRectifiedImages=false) const
Get the IVT Calibration. 
image_geometry::StereoCameraModel cam_model
bool fromCameraInfo(const sensor_msgs::CameraInfo &msg)
Set the camera parameters from the sensor_msgs/CameraInfo messages.