Go to the documentation of this file. 1 #ifndef IMAGE_GEOMETRY_STEREO_CAMERA_MODEL_H
2 #define IMAGE_GEOMETRY_STEREO_CAMERA_MODEL_H
25 bool fromCameraInfo(
const sensor_msgs::CameraInfo& left,
26 const sensor_msgs::CameraInfo& right);
31 bool fromCameraInfo(
const sensor_msgs::CameraInfoConstPtr& left,
32 const sensor_msgs::CameraInfoConstPtr& right);
50 std::string tfFrame()
const;
55 void projectDisparityTo3d(
const cv::Point2d& left_uv_rect,
float disparity, cv::Point3d& xyz)
const;
63 void projectDisparityImageTo3d(
const cv::Mat& disparity, cv::Mat& point_cloud,
64 bool handleMissingValues =
false)
const;
70 const cv::Matx44d& reprojectionMatrix()
const;
75 double baseline()
const;
82 double getZ(
double disparity)
const;
89 double getDisparity(
double Z)
const;
94 bool initialized()
const {
return left_.initialized() && right_.initialized(); }
std::string tfFrame() const
Get the name of the camera coordinate frame in tf.
Simplifies interpreting images geometrically using the parameters from sensor_msgs/CameraInfo.
bool initialized() const
Returns true if the camera has been initialized.
double getDisparity(double Z) const
Returns the disparity observed for a point at depth Z.
std::string tfFrame() const
Get the name of the camera coordinate frame in tf.
double Tx() const
Returns the x-translation term of the projection matrix.
double fx() const
Returns the focal length (pixels) in x direction of the rectified image.
Simplifies interpreting stereo image pairs geometrically using the parameters from the left and right...
const PinholeCameraModel & right() const
Get the right monocular camera model.
double getZ(double disparity) const
Returns the depth at which a point is observed with a given disparity.
static const double MISSING_Z
const cv::Matx44d & reprojectionMatrix() const
Returns the disparity reprojection matrix.
PinholeCameraModel right_
#define IMAGE_GEOMETRY_DECL
double cx() const
Returns the x coordinate of the optical center.
double baseline() const
Returns the horizontal baseline in world coordinates.
const PinholeCameraModel & left() const
Get the left monocular camera model.
image_geometry
Author(s): Patrick Mihelich
autogenerated on Wed Aug 21 2024 02:47:03