From 8c8e9d6e3700fc39a54bbe2bda0e309db2614014 Mon Sep 17 00:00:00 2001 From: Jacob Perron Date: Mon, 15 Nov 2021 17:30:08 -0800 Subject: [PATCH] Add Humble release note about geometry2#442 Related PR https://github.com/ros2/geometry2/pull/442 Signed-off-by: Jacob Perron --- source/Releases/Release-Humble-Hawksbill.rst | 11 +++++++++++ 1 file changed, 11 insertions(+) diff --git a/source/Releases/Release-Humble-Hawksbill.rst b/source/Releases/Release-Humble-Hawksbill.rst index 29fd5d746f..97e0725c75 100644 --- a/source/Releases/Release-Humble-Hawksbill.rst +++ b/source/Releases/Release-Humble-Hawksbill.rst @@ -321,6 +321,17 @@ The old-style arguments are still allowed in this release, but are deprecated an They will be removed in future releases. See https://github.com/ros2/geometry2/pull/392 for more details. +Transform listener spin thread no longer executes node callbacks +"""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""" + +``tf2_ros::TransformListener`` no longer spins on the provided node object. +Instead, it creates a callback group to execute callbacks on the entities it creates internally. +This means if you have set the parameter ``spin_thread=true`` when creating a transform listener, you +can no longer depend on your own callbacks to be executed. +You must call a ``spin`` function on your node (e.g. ``rclcpp::spin``), or add your node to your own executor. + +Related pull request: `geometry2#442 `_ + Known Issues ------------