diff --git a/camera_calibration/CHANGELOG.rst b/camera_calibration/CHANGELOG.rst index f85f9e3cf..c70d55a99 100644 --- a/camera_calibration/CHANGELOG.rst +++ b/camera_calibration/CHANGELOG.rst @@ -2,6 +2,12 @@ Changelog for package camera_calibration ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +6.0.3 (2024-08-20) +------------------ +* Refactoring calibration code (`#1000 `_) + Co-authored-by: Alejandro Hernández Cordero +* Contributors: Myron Rodrigues + 6.0.2 (2024-07-23) ------------------ diff --git a/depth_image_proc/CHANGELOG.rst b/depth_image_proc/CHANGELOG.rst index ff7924d45..44acbcd48 100644 --- a/depth_image_proc/CHANGELOG.rst +++ b/depth_image_proc/CHANGELOG.rst @@ -2,6 +2,26 @@ Changelog for package depth_image_proc ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +6.0.3 (2024-08-20) +------------------ +* Publish using unique ptr (`#1016 `_) + Prevents doing an extra copy of the data when using intra-process + communication. +* Finish QoS updates (`#1019 `_) + This implements the remainder of `#847 `_: + - Make sure publishers default to system defaults (reliable) + - Add QoS overriding where possible (some of the image_transport / + message_filters stuff doesn't really support that) + - Use the matching heuristic for subscribers consistently +* fix signature issue from `#943 `_ (`#1018 `_) + Without this, we get + ``` + symbol lookup error: /home/ubr/jazzy/install/depth_image_proc/lib/libdepth_image_proc.so: undefined symbol: _ZN16depth_image_proc10convertRgbERKSt10shared_ptrIKN11sensor_msgs3msg6Image_ISaIvEEEES0_INS2_12PointCloud2_IS4_EEEiiii + c++filt _ZN16depth_image_proc10convertRgbERKSt10shared_ptrIKN11sensor_msgs3msg6Image_ISaIvEEEES0_INS2_12PointCloud2_IS4_EEEiiii + depth_image_proc::convertRgb(std::shared_ptr > const> const&, std::shared_ptr > >, int, int, int, int) + ``` +* Contributors: Błażej Sowa, Michael Ferguson + 6.0.2 (2024-07-23) ------------------ * Removed deprecation warnings (`#1010 `_) diff --git a/image_pipeline/CHANGELOG.rst b/image_pipeline/CHANGELOG.rst index 20f53afc6..59b1e88e5 100644 --- a/image_pipeline/CHANGELOG.rst +++ b/image_pipeline/CHANGELOG.rst @@ -2,6 +2,16 @@ Changelog for package image_pipeline ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +6.0.3 (2024-08-20) +------------------ +* Finish QoS updates (`#1019 `_) + This implements the remainder of `#847 `_: + - Make sure publishers default to system defaults (reliable) + - Add QoS overriding where possible (some of the image_transport / + message_filters stuff doesn't really support that) + - Use the matching heuristic for subscribers consistently +* Contributors: Michael Ferguson + 6.0.2 (2024-07-23) ------------------ diff --git a/image_proc/CHANGELOG.rst b/image_proc/CHANGELOG.rst index d1b760ac5..607808d35 100644 --- a/image_proc/CHANGELOG.rst +++ b/image_proc/CHANGELOG.rst @@ -2,6 +2,20 @@ Changelog for package image_proc ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +6.0.3 (2024-08-20) +------------------ +* Publish using unique ptr (`#1016 `_) + Prevents doing an extra copy of the data when using intra-process + communication. +* Finish QoS updates (`#1019 `_) + This implements the remainder of `#847 `_: + - Make sure publishers default to system defaults (reliable) + - Add QoS overriding where possible (some of the image_transport / + message_filters stuff doesn't really support that) + - Use the matching heuristic for subscribers consistently +* Updated deprecated rcpputils::path (`#1014 `_) +* Contributors: Alejandro Hernández Cordero, Błażej Sowa, Michael Ferguson + 6.0.2 (2024-07-23) ------------------ diff --git a/image_publisher/CHANGELOG.rst b/image_publisher/CHANGELOG.rst index b9109771a..7c651a1e9 100644 --- a/image_publisher/CHANGELOG.rst +++ b/image_publisher/CHANGELOG.rst @@ -2,6 +2,19 @@ Changelog for package image_publisher ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +6.0.3 (2024-08-20) +------------------ +* Publish using unique ptr (`#1016 `_) + Prevents doing an extra copy of the data when using intra-process + communication. +* Finish QoS updates (`#1019 `_) + This implements the remainder of `#847 `_: + - Make sure publishers default to system defaults (reliable) + - Add QoS overriding where possible (some of the image_transport / + message_filters stuff doesn't really support that) + - Use the matching heuristic for subscribers consistently +* Contributors: Błażej Sowa, Michael Ferguson + 6.0.2 (2024-07-23) ------------------ diff --git a/image_rotate/CHANGELOG.rst b/image_rotate/CHANGELOG.rst index 41afd1de5..d6eae8fed 100644 --- a/image_rotate/CHANGELOG.rst +++ b/image_rotate/CHANGELOG.rst @@ -2,6 +2,19 @@ Changelog for package image_rotate ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +6.0.3 (2024-08-20) +------------------ +* Publish using unique ptr (`#1016 `_) + Prevents doing an extra copy of the data when using intra-process + communication. +* Finish QoS updates (`#1019 `_) + This implements the remainder of `#847 `_: + - Make sure publishers default to system defaults (reliable) + - Add QoS overriding where possible (some of the image_transport / + message_filters stuff doesn't really support that) + - Use the matching heuristic for subscribers consistently +* Contributors: Błażej Sowa, Michael Ferguson + 6.0.2 (2024-07-23) ------------------ diff --git a/image_view/CHANGELOG.rst b/image_view/CHANGELOG.rst index 88ae221d4..7ae219791 100644 --- a/image_view/CHANGELOG.rst +++ b/image_view/CHANGELOG.rst @@ -2,6 +2,16 @@ Changelog for package image_view ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +6.0.3 (2024-08-20) +------------------ +* Finish QoS updates (`#1019 `_) + This implements the remainder of `#847 `_: + - Make sure publishers default to system defaults (reliable) + - Add QoS overriding where possible (some of the image_transport / + message_filters stuff doesn't really support that) + - Use the matching heuristic for subscribers consistently +* Contributors: Michael Ferguson + 6.0.2 (2024-07-23) ------------------ * Removed deprecation warnings (`#1010 `_) diff --git a/stereo_image_proc/CHANGELOG.rst b/stereo_image_proc/CHANGELOG.rst index b454f5cb8..5366a5819 100644 --- a/stereo_image_proc/CHANGELOG.rst +++ b/stereo_image_proc/CHANGELOG.rst @@ -2,6 +2,13 @@ Changelog for package stereo_image_proc ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +6.0.3 (2024-08-20) +------------------ +* Publish using unique ptr (`#1016 `_) + Prevents doing an extra copy of the data when using intra-process + communication. +* Contributors: Błażej Sowa + 6.0.2 (2024-07-23) ------------------ * Removed deprecation warnings (`#1010 `_) diff --git a/tracetools_image_pipeline/CHANGELOG.rst b/tracetools_image_pipeline/CHANGELOG.rst index 592f50502..e65f91040 100644 --- a/tracetools_image_pipeline/CHANGELOG.rst +++ b/tracetools_image_pipeline/CHANGELOG.rst @@ -2,6 +2,9 @@ Changelog for package tracetools_image_pipeline ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +6.0.3 (2024-08-20) +------------------ + 6.0.2 (2024-07-23) ------------------