#include "image_geometry/pinhole_camera_model.h"#include <sensor_msgs/distortion_models.h>#include <string>#include <boost/make_shared.hpp>

Go to the source code of this file.
Classes | |
| struct | image_geometry::PinholeCameraModel::Cache |
Namespaces | |
| namespace | image_geometry |
Enumerations | |
| enum | image_geometry::DistortionState { image_geometry::NONE, image_geometry::CALIBRATED, image_geometry::UNKNOWN } |
Functions | |
| template<typename T > | |
| bool | image_geometry::update (const T &new_val, T &my_val) |
| template<typename MatT > | |
| bool | image_geometry::updateMat (const MatT &new_mat, MatT &my_mat, cv::Mat_< double > &cv_mat, int rows, int cols) |