diff --git a/camera_calibration/CHANGELOG.rst b/camera_calibration/CHANGELOG.rst index cb3a808c1..3157c36a9 100644 --- a/camera_calibration/CHANGELOG.rst +++ b/camera_calibration/CHANGELOG.rst @@ -2,6 +2,31 @@ Changelog for package camera_calibration ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +5.0.3 (2024-07-16) +------------------ +* Added stereo calibration using charuco board (backport `#976 `_) (`#1002 `_) + From `#972 `_ + Doing this first for rolling. + This was a TODO in the repository, opening this PR to add this feature. + - The main issue why this wasn't possible imo is the way `mk_obj_points` + works. I'm using the inbuilt opencv function to get the points there. + - The other is a condition when aruco markers are detected they are + added as good points, This is fine in case of mono but in stereo these + have to be the same number as the object points to find matches although + this should be possible with aruco.
This is an automatic backport of + pull request `#976 `_ done by [Mergify](https://mergify.com). + Co-authored-by: Myron Rodrigues <41271144+MRo47@users.noreply.github.com> +* Change camera info message to lower case (backport `#1005 `_) (`#1007 `_) + Change camera info message to lower case since message type had been + change in rolling and humble. + [](https://github.com/ros2/common_interfaces/blob/rolling/sensor_msgs/msg/CameraInfo.msg)
This + is an automatic backport of pull request `#1005 `_ done by + [Mergify](https://mergify.com). + --------- + Co-authored-by: SFhmichael <146928033+SFhmichael@users.noreply.github.com> + Co-authored-by: Alejandro Hernández Cordero +* Contributors: mergify[bot] + 5.0.2 (2024-05-27) ------------------ * fix: cv2.aruco.interpolateCornersCharuco is deprecated (backport `#979 `_) (`#980 `_) diff --git a/depth_image_proc/CHANGELOG.rst b/depth_image_proc/CHANGELOG.rst index dd1f51082..5c8ff87ab 100644 --- a/depth_image_proc/CHANGELOG.rst +++ b/depth_image_proc/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package depth_image_proc ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +5.0.3 (2024-07-16) +------------------ + 5.0.2 (2024-05-27) ------------------ diff --git a/image_pipeline/CHANGELOG.rst b/image_pipeline/CHANGELOG.rst index 56a460e8e..45bcd5c10 100644 --- a/image_pipeline/CHANGELOG.rst +++ b/image_pipeline/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package image_pipeline ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +5.0.3 (2024-07-16) +------------------ + 5.0.2 (2024-05-27) ------------------ diff --git a/image_proc/CHANGELOG.rst b/image_proc/CHANGELOG.rst index d6950418b..2281a14e8 100644 --- a/image_proc/CHANGELOG.rst +++ b/image_proc/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package image_proc ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +5.0.3 (2024-07-16) +------------------ + 5.0.2 (2024-05-27) ------------------ diff --git a/image_publisher/CHANGELOG.rst b/image_publisher/CHANGELOG.rst index d067925ea..632039067 100644 --- a/image_publisher/CHANGELOG.rst +++ b/image_publisher/CHANGELOG.rst @@ -2,6 +2,47 @@ Changelog for package image_publisher ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +5.0.3 (2024-07-16) +------------------ +* [jazzy] image_publisher: Fix loading of the camera info parameters on startup (backport `#983 `_) (`#995 `_) + As described in + https://github.com/ros-perception/image_pipeline/issues/965 camera info + is not loaded from the file on node initialization, but only when the + parameter is reloaded. + This PR resolves this issue and should be straightforward to port it to + `Humble`, `Iron` and `Jazzy`.
This is an automatic backport of pull + request `#983 `_ done by [Mergify](https://mergify.com). + Co-authored-by: Krzysztof Wojciechowski <49921081+Kotochleb@users.noreply.github.com> +* image_publisher: Fix image, constantly flipping when static image is published (backport `#986 `_) (`#987 `_) + Continuation of + https://github.com/ros-perception/image_pipeline/pull/984. + When publishing video stream from a camera, the image was flipped + correctly. Yet for a static image, which was loaded once, the flip + function was applied every time `ImagePublisher::doWork()` was called, + resulting in the published image being flipped back and forth all the + time. + This PR should be straightforward to port it to `Humble`, `Iron` and + `Jazzy`.
This is an automatic backport of pull request `#986 `_ done by + [Mergify](https://mergify.com). + Co-authored-by: Krzysztof Wojciechowski <49921081+Kotochleb@users.noreply.github.com> + Co-authored-by: Alejandro Hernández Cordero +* [jazzy] image_publisher: add field of view parameter (backport `#985 `_) (`#992 `_) + Currently, the default value for focal length when no camera info is + provided defaults to `1.0` rendering whole approximate intrinsics and + projection matrices useless. Based on [this + article](https://learnopencv.com/approximate-focal-length-for-webcams-and-cell-phone-cameras/), + I propose a better approximation of the focal length based on the field + of view of the camera. + For most of the use cases, users will either know the field of view of + the camera the used, or they already calibrated it ahead of time. + If there is some documentation to fill. please let me know. + This PR should be straightforward to port it to `Humble`, `Iron` and + `Jazzy`. +
This is an automatic backport of pull request `#985 `_ done by + [Mergify](https://mergify.com). + Co-authored-by: Krzysztof Wojciechowski <49921081+Kotochleb@users.noreply.github.com> +* Contributors: mergify[bot] + 5.0.2 (2024-05-27) ------------------ diff --git a/image_rotate/CHANGELOG.rst b/image_rotate/CHANGELOG.rst index 4f9a13be7..94dd23322 100644 --- a/image_rotate/CHANGELOG.rst +++ b/image_rotate/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package image_rotate ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +5.0.3 (2024-07-16) +------------------ + 5.0.2 (2024-05-27) ------------------ diff --git a/image_view/CHANGELOG.rst b/image_view/CHANGELOG.rst index 1df6b5536..ceb8cb492 100644 --- a/image_view/CHANGELOG.rst +++ b/image_view/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package image_view ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +5.0.3 (2024-07-16) +------------------ + 5.0.2 (2024-05-27) ------------------ diff --git a/stereo_image_proc/CHANGELOG.rst b/stereo_image_proc/CHANGELOG.rst index 56f637ed4..54811af3a 100644 --- a/stereo_image_proc/CHANGELOG.rst +++ b/stereo_image_proc/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package stereo_image_proc ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +5.0.3 (2024-07-16) +------------------ + 5.0.2 (2024-05-27) ------------------ diff --git a/tracetools_image_pipeline/CHANGELOG.rst b/tracetools_image_pipeline/CHANGELOG.rst index 32d6c7675..471dae140 100644 --- a/tracetools_image_pipeline/CHANGELOG.rst +++ b/tracetools_image_pipeline/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package tracetools_image_pipeline ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +5.0.3 (2024-07-16) +------------------ + 5.0.2 (2024-05-27) ------------------