| Classes | |
| class | Exception | 
| class | PinholeCameraModel | 
| Simplifies interpreting images geometrically using the parameters from sensor_msgs/CameraInfo.  More... | |
| class | StereoCameraModel | 
| Simplifies interpreting stereo image pairs geometrically using the parameters from the left and right sensor_msgs/CameraInfo.  More... | |
| Enumerations | |
| enum | DistortionModel { EQUIDISTANT, PLUMB_BOB_OR_RATIONAL_POLYNOMIAL, UNKNOWN_MODEL } | 
| enum | DistortionState { NONE, CALIBRATED, UNKNOWN } | 
| Functions | |
| template<typename T > | |
| bool | update (const T &new_val, T &my_val) | 
| template<typename MatT > | |
| bool | updateMat (const MatT &new_mat, MatT &my_mat, cv::Mat_< double > &cv_mat, int rows, int cols) | 
| template<typename MatT , typename MatU > | |
| bool | updateMat (const MatT &new_mat, MatT &my_mat, MatU &cv_mat) | 
| Enumerator | |
|---|---|
| EQUIDISTANT | |
| PLUMB_BOB_OR_RATIONAL_POLYNOMIAL | |
| UNKNOWN_MODEL | |
Definition at line 11 of file pinhole_camera_model.cpp.
| Enumerator | |
|---|---|
| NONE | |
| CALIBRATED | |
| UNKNOWN | |
Definition at line 10 of file pinhole_camera_model.cpp.
| bool image_geometry::update | ( | const T & | new_val, | 
| T & | my_val | ||
| ) | 
Definition at line 66 of file pinhole_camera_model.cpp.
| bool image_geometry::updateMat | ( | const MatT & | new_mat, | 
| MatT & | my_mat, | ||
| cv::Mat_< double > & | cv_mat, | ||
| int | rows, | ||
| int | cols | ||
| ) | 
Definition at line 76 of file pinhole_camera_model.cpp.
| bool image_geometry::updateMat | ( | const MatT & | new_mat, | 
| MatT & | my_mat, | ||
| MatU & | cv_mat | ||
| ) | 
Definition at line 87 of file pinhole_camera_model.cpp.