#include "image_geometry/pinhole_camera_model.h"
#include <sensor_msgs/distortion_models.h>
#include <opencv2/calib3d/calib3d.hpp>
Go to the source code of this file.
Classes | |
struct | image_geometry::PinholeCameraModel::Cache |
Namespaces | |
image_geometry | |
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) |
template<typename MatT , typename MatU > | |
bool | image_geometry::updateMat (const MatT &new_mat, MatT &my_mat, MatU &cv_mat) |