ros / common_msgs

Commonly used messages in ROS. Includes messages for actions (actionlib_msgs), diagnostics (diagnostic_msgs), geometric primitives (geometry_msgs), robot navigation (nav_msgs), and common sensors (sensor_msgs), such as laser range finders, cameras, point clouds.
http://wiki.ros.org/common_msgs
177 stars 191 forks source link

support for cv::omnidir #178

Closed Nosille closed 1 year ago

Nosille commented 2 years ago

I have found the current fisheye distortion models in ROS to be insufficient for very wide angle lenses. OpenCV contains an additional calibration method that is capable of modeling catadioptric cameras and fisheye cameras with very wide fields of view. I am working on implementing that method in vision_opencv and the image_pipeline, but it requires a placeholder entry in sensor_msgs/distortion_models.h.

https://docs.opencv.org/3.4/db/dd2/namespacecv_1_1omnidir.html https://docs.opencv.org/4.x/dd/d12/tutorial_omnidir_calib_main.html