Public Member Functions | Private Attributes | List of all members
ivt_bridge::IvtCalibration Class Reference

#include <ivt_calibration.h>

Public Member Functions

bool fromCameraInfo (const sensor_msgs::CameraInfo &msg)
 Set the camera parameters from the sensor_msgs/CameraInfo messages. More...
 
bool fromCameraInfo (const sensor_msgs::CameraInfoConstPtr &msg)
 Set the camera parameters from the sensor_msgs/CameraInfo messages. More...
 
boost::shared_ptr< CCalibration > getCalibration (bool forRectifiedImages=false) const
 Get the IVT Calibration. More...
 

Private Attributes

image_geometry::PinholeCameraModel cam_model
 

Detailed Description

IVT IvtCalibration class. Conversion between representation of calibration parameters for mono camera as ROS message and IVT datastructure.

Author
Pascal Meissner, Daniel Kleinert.
Version
See SVN.

Definition at line 38 of file ivt_calibration.h.

Member Function Documentation

bool ivt_bridge::IvtCalibration::fromCameraInfo ( const sensor_msgs::CameraInfo &  msg)

Set the camera parameters from the sensor_msgs/CameraInfo messages.

Definition at line 102 of file ivt_calibration.cpp.

bool ivt_bridge::IvtCalibration::fromCameraInfo ( const sensor_msgs::CameraInfoConstPtr &  msg)

Set the camera parameters from the sensor_msgs/CameraInfo messages.

Definition at line 106 of file ivt_calibration.cpp.

boost::shared_ptr< CCalibration > ivt_bridge::IvtCalibration::getCalibration ( bool  forRectifiedImages = false) const

Get the IVT Calibration.

Parameters
forRectifiedImagesIf true the calibration will be for rectified images of ros::image_proc, otherwise for a (colored) raw image

Definition at line 110 of file ivt_calibration.cpp.

Member Data Documentation

image_geometry::PinholeCameraModel ivt_bridge::IvtCalibration::cam_model
private

Definition at line 60 of file ivt_calibration.h.


The documentation for this class was generated from the following files:


asr_ivt_bridge
Author(s): Hutmacher Robin, Kleinert Daniel, Meißner Pascal
autogenerated on Mon Jun 10 2019 12:39:24