Skip to content

Commit

Permalink
Changelog
Browse files Browse the repository at this point in the history
Signed-off-by: Alejandro Hernández Cordero <[email protected]>
  • Loading branch information
ahcorde committed Jul 16, 2024
1 parent 8a6865e commit 227243f
Show file tree
Hide file tree
Showing 9 changed files with 87 additions and 0 deletions.
25 changes: 25 additions & 0 deletions camera_calibration/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,31 @@
Changelog for package camera_calibration
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

5.0.3 (2024-07-16)
------------------
* Added stereo calibration using charuco board (backport `#976 <https://github.com/ros-perception/image_pipeline/issues/976>`_) (`#1002 <https://github.com/ros-perception/image_pipeline/issues/1002>`_)
From `#972 <https://github.com/ros-perception/image_pipeline/issues/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.<hr>This is an automatic backport of
pull request `#976 <https://github.com/ros-perception/image_pipeline/issues/976>`_ done by [Mergify](https://mergify.com).
Co-authored-by: Myron Rodrigues <[email protected]>
* Change camera info message to lower case (backport `#1005 <https://github.com/ros-perception/image_pipeline/issues/1005>`_) (`#1007 <https://github.com/ros-perception/image_pipeline/issues/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)<hr>This
is an automatic backport of pull request `#1005 <https://github.com/ros-perception/image_pipeline/issues/1005>`_ done by
[Mergify](https://mergify.com).
---------
Co-authored-by: SFhmichael <[email protected]>
Co-authored-by: Alejandro Hernández Cordero <[email protected]>
* Contributors: mergify[bot]

5.0.2 (2024-05-27)
------------------
* fix: cv2.aruco.interpolateCornersCharuco is deprecated (backport `#979 <https://github.com/ros-perception/image_pipeline/issues/979>`_) (`#980 <https://github.com/ros-perception/image_pipeline/issues/980>`_)
Expand Down
3 changes: 3 additions & 0 deletions depth_image_proc/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package depth_image_proc
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

5.0.3 (2024-07-16)
------------------

5.0.2 (2024-05-27)
------------------

Expand Down
3 changes: 3 additions & 0 deletions image_pipeline/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package image_pipeline
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

5.0.3 (2024-07-16)
------------------

5.0.2 (2024-05-27)
------------------

Expand Down
3 changes: 3 additions & 0 deletions image_proc/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package image_proc
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

5.0.3 (2024-07-16)
------------------

5.0.2 (2024-05-27)
------------------

Expand Down
41 changes: 41 additions & 0 deletions image_publisher/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -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 <https://github.com/ros-perception/image_pipeline/issues/983>`_) (`#995 <https://github.com/ros-perception/image_pipeline/issues/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`.<hr>This is an automatic backport of pull
request `#983 <https://github.com/ros-perception/image_pipeline/issues/983>`_ done by [Mergify](https://mergify.com).
Co-authored-by: Krzysztof Wojciechowski <[email protected]>
* image_publisher: Fix image, constantly flipping when static image is published (backport `#986 <https://github.com/ros-perception/image_pipeline/issues/986>`_) (`#987 <https://github.com/ros-perception/image_pipeline/issues/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`.<hr>This is an automatic backport of pull request `#986 <https://github.com/ros-perception/image_pipeline/issues/986>`_ done by
[Mergify](https://mergify.com).
Co-authored-by: Krzysztof Wojciechowski <[email protected]>
Co-authored-by: Alejandro Hernández Cordero <[email protected]>
* [jazzy] image_publisher: add field of view parameter (backport `#985 <https://github.com/ros-perception/image_pipeline/issues/985>`_) (`#992 <https://github.com/ros-perception/image_pipeline/issues/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`.
<hr>This is an automatic backport of pull request `#985 <https://github.com/ros-perception/image_pipeline/issues/985>`_ done by
[Mergify](https://mergify.com).
Co-authored-by: Krzysztof Wojciechowski <[email protected]>
* Contributors: mergify[bot]

5.0.2 (2024-05-27)
------------------

Expand Down
3 changes: 3 additions & 0 deletions image_rotate/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package image_rotate
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

5.0.3 (2024-07-16)
------------------

5.0.2 (2024-05-27)
------------------

Expand Down
3 changes: 3 additions & 0 deletions image_view/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package image_view
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

5.0.3 (2024-07-16)
------------------

5.0.2 (2024-05-27)
------------------

Expand Down
3 changes: 3 additions & 0 deletions stereo_image_proc/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package stereo_image_proc
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

5.0.3 (2024-07-16)
------------------

5.0.2 (2024-05-27)
------------------

Expand Down
3 changes: 3 additions & 0 deletions tracetools_image_pipeline/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,9 @@
Changelog for package tracetools_image_pipeline
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

5.0.3 (2024-07-16)
------------------

5.0.2 (2024-05-27)
------------------

Expand Down

0 comments on commit 227243f

Please sign in to comment.