diff --git a/camera_calibration/CHANGELOG.rst b/camera_calibration/CHANGELOG.rst index 7f9afaee3..45bf40ef1 100644 --- a/camera_calibration/CHANGELOG.rst +++ b/camera_calibration/CHANGELOG.rst @@ -2,6 +2,23 @@ Changelog for package camera_calibration ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +3.0.5 (2024-07-24) +------------------ +* Change camera info message to lower case (backport `#1005 `_) (`#1008 `_) + 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 +* [backport humble] Fix spelling error for cv2.aruco.DICT from 6x6_50 to 7x7_1000 (`#961 `_) (`#1004 `_) + Backport `#961 `_ fix to humble + Co-authored-by: Vishal Balaji + Co-authored-by: Vishal Balaji +* Contributors: Balint Rozgonyi, mergify[bot] + 3.0.4 (2024-03-01) ------------------ diff --git a/depth_image_proc/CHANGELOG.rst b/depth_image_proc/CHANGELOG.rst index 99c0350db..d733f6c06 100644 --- a/depth_image_proc/CHANGELOG.rst +++ b/depth_image_proc/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package depth_image_proc ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +3.0.5 (2024-07-24) +------------------ + 3.0.4 (2024-03-01) ------------------ * [backport humble] Fixed image types in depth_image_proc (`#916 `_) diff --git a/image_pipeline/CHANGELOG.rst b/image_pipeline/CHANGELOG.rst index 611d36d7e..54b239135 100644 --- a/image_pipeline/CHANGELOG.rst +++ b/image_pipeline/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package image_pipeline ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +3.0.5 (2024-07-24) +------------------ + 3.0.4 (2024-03-01) ------------------ diff --git a/image_proc/CHANGELOG.rst b/image_proc/CHANGELOG.rst index ddf550d1e..ae2a571e0 100644 --- a/image_proc/CHANGELOG.rst +++ b/image_proc/CHANGELOG.rst @@ -2,6 +2,14 @@ Changelog for package image_proc ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +3.0.5 (2024-07-24) +------------------ +* [backport humble] Node namespace parameter (`#963 `_) + Backport pull request `#925 `_ which solves issue `#952 `_ by adding the + `namespace` parameter to the `image_proc` launch file + Co-authored-by: Lucas Wendland <82680922+CursedRock17@users.noreply.github.com> +* Contributors: Alejandro Hernández Cordero + 3.0.4 (2024-03-01) ------------------ diff --git a/image_publisher/CHANGELOG.rst b/image_publisher/CHANGELOG.rst index c496ee284..b1674fc44 100644 --- a/image_publisher/CHANGELOG.rst +++ b/image_publisher/CHANGELOG.rst @@ -2,6 +2,49 @@ Changelog for package image_publisher ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +3.0.5 (2024-07-24) +------------------ +* [humble] image_publisher: Fix loading of the camera info parameters on startup (backport `#983 `_) (`#996 `_) + 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> + Co-authored-by: Michael Ferguson +* image_publisher: add field of view parameter (backport `#985 `_) (`#993 `_) + 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> +* image_publisher: Fix image, constantly flipping when static image is published (backport `#986 `_) (`#988 `_) + 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 +* Contributors: mergify[bot] + 3.0.4 (2024-03-01) ------------------ diff --git a/image_rotate/CHANGELOG.rst b/image_rotate/CHANGELOG.rst index dc11639c4..529693986 100644 --- a/image_rotate/CHANGELOG.rst +++ b/image_rotate/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package image_rotate ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +3.0.5 (2024-07-24) +------------------ + 3.0.4 (2024-03-01) ------------------ diff --git a/image_view/CHANGELOG.rst b/image_view/CHANGELOG.rst index 56e232593..73de79d66 100644 --- a/image_view/CHANGELOG.rst +++ b/image_view/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package image_view ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +3.0.5 (2024-07-24) +------------------ + 3.0.4 (2024-03-01) ------------------ diff --git a/stereo_image_proc/CHANGELOG.rst b/stereo_image_proc/CHANGELOG.rst index 07b965243..340016d9b 100644 --- a/stereo_image_proc/CHANGELOG.rst +++ b/stereo_image_proc/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package stereo_image_proc ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +3.0.5 (2024-07-24) +------------------ + 3.0.4 (2024-03-01) ------------------ diff --git a/tracetools_image_pipeline/CHANGELOG.rst b/tracetools_image_pipeline/CHANGELOG.rst index 5464d499c..f04d32f8d 100644 --- a/tracetools_image_pipeline/CHANGELOG.rst +++ b/tracetools_image_pipeline/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package tracetools_image_pipeline ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +3.0.5 (2024-07-24) +------------------ + 3.0.4 (2024-03-01) ------------------