You're reading the documentation for an older, but still supported, version of ROS 2. For information on the latest version, please have a look at Jazzy.
Iron Irwini Changelog
This page is a list of the complete changes in all ROS 2 core packages since the previous release.
action_msgs
action_tutorials_cpp
action_tutorials_interfaces
action_tutorials_py
actionlib_msgs
ament_clang_format
ament_clang_tidy
ament_cmake
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_auto
ament_cmake_clang_format
ament_cmake_clang_tidy
ament_cmake_copyright
ament_cmake_core
ament_cmake_uninstall_target: Correct location of install_manifest.txt (#432)
Use file(GENERATE OUTPUT) to create dsv files (#416) Using file(WRITE) and file(APPEND) causes the modification stamp of the file to be changed each time CMake configures, resluting in an ‘Installing’ message rather than an ‘Up-to-date’ message even though the file content is identical. Using file(GENERATE OUTPUT) updates the timestamp of the file only if the content changes.
Warn when trying to symlink install an INTERFACE_LIBRARY (#417)
Workaround to exclude Clion’s cmake folders from colcon test (#410) - Add AMENT_IGNORE to CMAKE_BINARY_DIR to avoid picking up cmake specific folders created by CLion in
colcon build
andcolcon test
commandsif (NOT ${UNDEFINED_VAR}) gets evaluated to false, so change to if (NOT UNDEFINED_VAR) so it evaluates to true. (#407)
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Implement ament_add_default_options (#390)
Contributors: Audrow Nash, Kenji Brameld, Michael Orlov, Scott K Logan, Shane Loretz, Silvio Traversaro, methylDragon
ament_cmake_cppcheck
ament_cmake_cpplint
ament_cmake_export_definitions
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_export_dependencies
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_export_include_directories
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_export_interfaces
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_export_libraries
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_export_link_flags
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_export_targets
ament_cmake_flake8
ament_cmake_gen_version_h
ament_cmake_gmock
Fix compiler warnings related to gtest/gmock (#408) * Suppress compiler warnings when building gmock definition of implicit copy constructor … is deprecated because it has a user-declared copy assignment operator [-Wdeprecated-copy] * Declare gtest/gmock include dirs as SYSTEM PRIVATE for test targets
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash, Robert Haschke
ament_cmake_google_benchmark
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_gtest
Fix compiler warnings related to gtest/gmock (#408) * Suppress compiler warnings when building gmock definition of implicit copy constructor … is deprecated because it has a user-declared copy assignment operator [-Wdeprecated-copy] * Declare gtest/gmock include dirs as SYSTEM PRIVATE for test targets
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash, Robert Haschke
ament_cmake_include_directories
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_libraries
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_lint_cmake
ament_cmake_mypy
ament_cmake_pclint
ament_cmake_pep257
ament_cmake_pycodestyle
ament_cmake_pyflakes
ament_cmake_pytest
Fix test skipping logic for missing pytest module (#441)
Add missing buildtool_depend on python3-pytest (#440)
ament_cmake_pytest needs a buildtool_depend on ament_cmake_test. (#439)
Fix pytest-cov version detection with pytest >=7.0.0 (#436)
use the error handler replace to allow non-utf8 to be decoded (#381)
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Add NOCAPTURE option to ament_add_pytest_test (#393)
Contributors: Audrow Nash, Chris Lalancette, Christophe Bedard, El Jawad Alaa, Jacob Perron, Scott K Logan
ament_cmake_python
ament_cmake_ros
ament_cmake_target_dependencies
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_test
ament_cmake_uncrustify
ament_cmake_vendor_package
Fix the version number of ament_cmake_vendor_package.
Add ament_cmake_vendor_package package (#429)
Contributors: Chris Lalancette, Scott K Logan
ament_cmake_version
[rolling] Update maintainers - 2022-11-07 (#411) * Update maintainers to Michael Jeronimo
Contributors: Audrow Nash
ament_cmake_xmllint
ament_copyright
ament_cppcheck
ament_cpplint
ament_flake8
ament_index_cpp
[rolling] Update maintainers - 2022-11-07 (#89)
Contributors: Audrow Nash
ament_index_python
[rolling] Update maintainers - 2022-11-07 (#89)
Contributors: Audrow Nash
ament_lint
ament_lint_auto
ament_lint_cmake
ament_lint_common
ament_mypy
ament_package
ament_pclint
ament_pep257
updating ref to pep257 docs (#433)
Added underscore to ignore new pydocstyle item (#428)
[rolling] Update maintainers - 2022-11-07 (#421)
[ament_pep257][master] redirecting error prints to stderr (#390)
Update maintainers (#379)
Contributors: Audrow Nash, Christian Henkel, Cristóbal Arroyo, Mirco Colosi (CR/AAS3), methylDragon
ament_pycodestyle
ament_pyflakes
ament_uncrustify
ament_xmllint
builtin_interfaces
camera_calibration_parsers
camera_info_manager
class_loader
make sanitizer happy (#205)
[rolling] Update maintainers - 2022-11-07 (#206)
Remove appveyor configuration. (#204)
Just fix a typo in a comment. (#203)
make the meta-object alive in the lifecycle of the registered plugin (#201)
Mirror rolling to ros2
Contributors: Audrow Nash, Chen Lihui, Chris Lalancette
common_interfaces
[rolling] Update maintainers - 2022-11-07 (#210)
Contributors: Audrow Nash
composition
Change all ROS2 -> ROS 2. (#610)
update launch file name format to match documentation (#588)
Added README.md for composition (#598)
Update the demos to C++17. (#594)
[rolling] Update maintainers - 2022-11-07 (#589)
fix memory leak (#585)
Contributors: Audrow Nash, Chen Lihui, Chris Lalancette, Gary Bey, Patrick Wspanialy
composition_interfaces
demo_nodes_cpp
Change all ROS2 -> ROS 2. (#610)
Add matched event demo for rclcpp and rclpy (#607)
Fix the set_parameters_callback example program. (#608)
[demo_nodes_cpp] Add YAML launch demos for topics (#605)
update launch file name format to match documentation (#588)
Service introspection (#602) * Add in a rclcpp and rclpy demo of introspection.
Added README.md for demo_cpp_nodes (#599)
Update the demos to C++17. (#594)
[rolling] Update maintainers - 2022-11-07 (#589)
Demo for pre and post set parameter callback support (#565) * local parameter callback support
counter starts from 1, not 2. (#562)
add a demo of content filter listener (#557)
Contributors: Audrow Nash, Barry Xu, Chen Lihui, Chris Lalancette, Damien LaRocque, Deepanshu Bansal, Gary Bey, Patrick Wspanialy, Tomoya Fujita
demo_nodes_cpp_native
Change all ROS2 -> ROS 2. (#610)
Added README.md for demo_cpp_nodes_native (#597)
Update the demos to C++17. (#594)
[rolling] Update maintainers - 2022-11-07 (#589)
Make demo_nodes_cpp_native install stuff only when it builds (#590)
Contributors: Audrow Nash, Chris Lalancette, Gary Bey, Shane Loretz
demo_nodes_py
Change all ROS2 -> ROS 2. (#610)
Add matched event demo for rclcpp and rclpy (#607)
Enable document generation using rosdoc2 (#606)
Service introspection (#602)
Added README.md for demo_nodes_py (#600)
[rolling] Update maintainers - 2022-11-07 (#589)
Demo for pre and post set parameter callback support (#565)
Add demo for rclpy parameter client (#566)
Exit with code 0 if ExternalShutdownException is raised (#581)
Contributors: Audrow Nash, Barry Xu, Brian, Chris Lalancette, Deepanshu Bansal, Gary Bey, Jacob Perron, Yadu
diagnostic_msgs
domain_coordinator
dummy_map_server
dummy_robot_bringup
dummy_sensors
eigen3_cmake_module
example_interfaces
examples_rclcpp_async_client
examples_rclcpp_cbg_executor
examples_rclcpp_minimal_action_client
examples_rclcpp_minimal_action_server
examples_rclcpp_minimal_client
examples_rclcpp_minimal_composition
examples_rclcpp_minimal_publisher
examples_rclcpp_minimal_service
examples_rclcpp_minimal_subscriber
examples_rclcpp_minimal_timer
examples_rclcpp_multithreaded_executor
examples_rclcpp_wait_set
examples_rclpy_executors
[rolling] Update maintainers - 2022-11-07 (#352)
Contributors: Audrow Nash
examples_rclpy_guard_conditions
[rolling] Update maintainers - 2022-11-07 (#352)
Contributors: Audrow Nash
examples_rclpy_minimal_action_client
examples_rclpy_minimal_action_server
[rolling] Update maintainers - 2022-11-07 (#352)
Contributors: Audrow Nash
examples_rclpy_minimal_client
[rolling] Update maintainers - 2022-11-07 (#352)
Contributors: Audrow Nash
examples_rclpy_minimal_publisher
[rolling] Update maintainers - 2022-11-07 (#352)
Contributors: Audrow Nash
examples_rclpy_minimal_service
[rolling] Update maintainers - 2022-11-07 (#352)
Contributors: Audrow Nash
examples_rclpy_minimal_subscriber
[rolling] Update maintainers - 2022-11-07 (#352)
Contributors: Audrow Nash
examples_rclpy_pointcloud_publisher
[rolling] Update maintainers - 2022-11-07 (#352)
Contributors: Audrow Nash
examples_tf2_py
fastrtps_cmake_module
[rolling] Update maintainers - 2022-11-07 (#93)
Contributors: Audrow Nash
foonathan_memory_vendor
Added support for QNX 7.1 build (#65)
Update upstream to release 0.7-3 (#62)(#63)
Fix CMake minimum required version (#60)
geometry2
Update maintainers (#560)
Contributors: Audrow Nash
geometry_msgs
google_benchmark_vendor
Actually update to 1.6.1. (#25) We claimed we were, but in fact we were pinned to the 1.5.3 git hash.
Remove set but unused variable (#24) Clang checks -Wunused-but-set-variable. This fails the build with -Werror also enabled.
[rolling] Update maintainers - 2022-11-07 (#22)
Mirror rolling to main
Contributors: Audrow Nash, Chris Lalancette, Michael Carroll
ignition_cmake2_vendor
Set target version to 2.14.0 (#5)
Mirror rolling to main
Contributors: Audrow Nash, Yadu
ignition_math6_vendor
Forward CMAKE_PREFIX_PATH when building vendor package (#8)
Contributors: Scott K Logan
image_tools
image_transport
Update image_common to C++17. (#267)
Add alias library targets for all libraries (#259)
Remove subscriber and publisher impl methods without options (#252)
Deprecate impl without options (#249)
opt-in to qos overriding for publisher (#246)
Add qos option to override qos (#208)
Contributors: Brian, Chris Lalancette, Daisuke Nishimatsu, Kenji Brameld, RFRIEDM-Trimble
interactive_markers
intra_process_demo
kdl_parser
Switch some tests to use unique pointers instead of raw pointers. (#74)
log link children as DEBUG instead of INFO (#71)
Enable the kdl_parser tests in ROS 2 (#68)
Add in a LICENSE file and fix up copyright headers (#66)
Use orocos_kdl_vendor and orocos-kdl target (#64)
Use the rcutils logger instead of printf (#65)
Contributors: Chris Lalancette, Joseph Schornak, Scott K Logan, yuraSomatic
keyboard_handler
Force exit from main thread on signal handling in
keyboard_handler
(#23)Contributors: Michael Orlov
laser_geometry
launch
Document LaunchService.{run,run_async}() return value (#702)
[rosdoc2] Fix document generation on buildfarm (#701)
Enable document generation using rosdoc2 for ament_python pkgs (#697)
Remove the import of Literal from entity.py. (#694)
Fix flake8 errors. (#695)
add symlink to latest log directory (#686)
Improve type checking (#679)
Fixed typos (#692)
Pass modules to PythonExpression (#655)
Allow ReadyToTest() usage in event handler (#665)
Expose emulate_tty to xml and yaml launch (#669)
Expose sigterm_timeout and sigkill_timeout to xml frontend (#667)
[rolling] Update maintainers - 2022-11-07 (#671)
Expect deprecation warnings in tests (#657)
Fix the restoring of os.environ to maintain type. (#656)
Implement Any, All, Equals, and NotEquals substitutions (#649)
add LaunchLogDir substitution, replacing log_dir frontend only substitution (#652)
Add special cases to coerce “1” and “0” to bool when using bool coercion only (#651)
Update launch/test/launch/test_execute_local.py
Added unit test ensuring that output dictionary works with ExecuteLocal
Addresses issue #588, allowing dict for ‘output’
Remove unused variables. (#612)
Expose shutdown action to xml frontend (#611)
Contributors: Aditya Pande, Alejandro Hernández Cordero, Audrow Nash, Blake Anderson, Chris Lalancette, Christophe Bedard, Hervé Audren, Jacob Perron, Matthew Elwin, Michael Jeronimo, Nikolai Morin, Welte, William Woodall, Yadu, methylDragon
launch_pytest
launch_ros
Use SomeEntitiesType for type checking. (#358)
Fix normalize_parameters_dict for multiple nodes in the same namespace (#347)
Implement None check for ComposableNodeContainer (#341)
Add LifecyleTransition action (#317)
Improve evaluate_paramenter_dict exceptions error message (#320)
Ensure load_composable_nodes respects condition (#339)
fix: return text value to avoid exception (#338)
[rolling] Update maintainers - 2022-11-07 (#331)
RosTimer -> ROSTimer and PushRosNamespace -> PushROSNamespace, to follow PEP8 (#326)
add SetROSLogDir action (#325)
Support default values in parameter substitution (#313)
Run condition for composable nodes (#311)
Contributors: Aditya Pande, Alexey Merzlyakov, Audrow Nash, Chris Lalancette, Christoph Hellmann Santos, Daisuke Nishimatsu, Felipe Gomes de Melo, Kenji Miyake, William Woodall, methylDragon
launch_testing
Improve type checking (#679)
Fixed typos (#692)
Allow ReadyToTest() usage in event handler (#665)
Inherit markers from generate_test_description (#670)
[rolling] Update maintainers - 2022-11-07 (#671)
Fix Typo (#641)
ReadyToTest action timeout using decorator (#625)
Switch to using a comprehension for process_names. (#614)
Contributors: Alejandro Hernández Cordero, Audrow Nash, Chris Lalancette, Deepanshu Bansal, Hervé Audren, Kenji Brameld, Nikolai Morin, Scott K Logan
launch_testing_ament_cmake
[rolling] Update maintainers - 2022-11-07 (#671)
Contributors: Audrow Nash
launch_testing_examples
launch_testing_ros
Increase the timeouts in wait_for_topic_launch_test. (#360)
Enable document generation using rosdoc2 (#359)
exit() methods should not reraise the passed-in exception (#357)
Inherit markers from generate_test_description (#330)
[rolling] Update maintainers - 2022-11-07 (#331)
Fix long wait during shutdown in WaitForTopics (#314)
Contributors: Audrow Nash, Chris Lalancette, Giorgio Pintaudi, Keng12, Scott K Logan, Yadu
launch_xml
launch_yaml
libcurl_vendor
libstatistics_collector
Bump hmarr/auto-approve-action from 3.2.0 to 3.2.1
Mark benchmark _ as unused. (#158)
Bump hmarr/auto-approve-action from 3.1.0 to 3.2.0
Bump ros-tooling/action-ros-ci from 0.2 to 0.3
Bump pascalgn/automerge-action from 0.15.5 to 0.15.6
Update libstatistics_collector to C++17. (#154)
Remove unnecessary build dependency on std_msgs. (#145)
Bump pascalgn/automerge-action from 0.15.2 to 0.15.3
Cleanup the CI jobs on this repository. (#146)
Check if message has a “header” field with a stamp subfield of type builtin_interfaces::msg::Time (#54)
Mirror rolling to master
Contributors: Audrow Nash, Chris Lalancette, Scott Mende, dependabot[bot]
libyaml_vendor
Fix system package dependency (#54)
Update libyaml_vendor to C++17. (#55)
[rolling] Update maintainers - 2022-11-07 (#53)
Remove a warning message. (#51)
check if libyaml is already present before building it (take 2) (#45)
Mirror rolling to master
Support WindowsStore builds for ROS2 (#50) * libyaml for uwp
Contributors: Audrow Nash, Chris Lalancette, Lou Amadio, Scott K Logan, Silvio Traversaro
lifecycle
lifecycle_msgs
lifecycle_py
Enable document generation using rosdoc2 (#606)
update launch file name format to match documentation (#588)
Cleanup lifecycle_py to conform to ROS 2 standards. (#604)
[rolling] Update maintainers - 2022-11-07 (#589)
Install the launch file for lifecycle_py. (#586)
Contributors: Audrow Nash, Chris Lalancette, Patrick Wspanialy, Yadu
logging_demo
map_msgs
Update maintainers
Contributors: Audrow Nash, Steve Macenski
mcap_vendor
mcap_vendor: add readme with versioning procedure (#1230)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
mcap_vendor: only install public headers (#1207)
Fixes policy CMP0135 warning for CMake >= 3.24 for mcap_vendor (#1208)
mcap_vendor: download MCAP source via tarball (#1204)
rosbag2_cpp: test more than one storage plugin (#1196)
rosbag2_storage_mcap: merge into rosbag2 repo (#1163)
Fix Windows build (#73) Update mcap version to newest windows-compatible release. Add visibility macros for tests. Add clang-format preprocessor indentation for visibility_control to be readable.
mcap_vendor: update to v0.6.0 (#69)
Cleanup in
mcap_vendor
package (#62)Switch to using the vendored zstd library. (#59)
Support timestamp-ordered playback (#50)
Support regex topic filtering
Add all lz4 sources to fix undefined symbols at runtime (#46)
Upgrade mcap to fix LZ4 error and segfault (#42) Incorporates fixes from https://github.com/foxglove/mcap/pull/478 and https://github.com/foxglove/mcap/pull/482
Add missing buildtool_depend on git (#37) This vendor package uses git to fetch sources for other packages. It should declare a dependency on that build tool. This should address the current cause of RPM build failures for RHEL: https://build.ros2.org/view/Rbin_rhel_el864/job/Rbin_rhel_el864__mcap_vendor__rhel_8_x86_64__binary/
Test Foxy & Galactic in CI, fix missing test_depends in mcap_vendor/package.xml (#33)
fix: minor issues (#31) * remove unnecessary block * use target_link_libraries instead of ament_target_dependencies * remove ros environment * add prefix to compile definition
Update email address for Foxglove maintainers (#32)
Added mcap_vendor package. Updated CMakeLists.txt to fetch dependencies with FetchContent rather than Conan.
Contributors: Chris Lalancette, Cristóbal Arroyo, Daisuke Nishimatsu, Emerson Knapp, Jacob Bandes-Storch, James Smith, Michael Orlov, Scott K Logan, james-rms
message_filters
Update message_filters to C++17. (#88)
Fix cache.h std::placeholder namespace (#87)
[rolling] Update maintainers - 2022-11-07 (#85)
Add a simpler aproximate time sync policy: ApproximateEpsilonTime (#84)
Add latest time zero-order-hold sync policy (#73)
Fix python examples and add a new example in documentation (#79)
Mirror rolling to master
Adding fix to subscribe() call with raw node pointer and subscriber options (#76)
Corrected function arguments in example description (#35)
Changed invocation to
add
to conform template syntax (#1388)fix sphinx warning (#1371)
change invocation to
add
to conform template syntax (#1388)fix sphinx warning (#1371)
Contributors: Audrow Nash, Carlos Andrés Álvarez Restrepo, Chris Lalancette, Haoru Xue, Ivan Santiago Paunovic, Martin Ganeff, Steve Macenski, andermi
mimick_vendor
[rolling] Update maintainers - 2022-11-07 (#29)
Mirror rolling to master
Contributors: Audrow Nash
orocos_kdl_vendor
osrf_pycommon
osrf_testing_tools_cpp
Fix mpark/variant conditional for MSVC (#77)
Changing C++ Compile Version (#76)
Update maintainers (#74)
Sets CMP0135 policy behavior to NEW (#73)
Fixes policy CMP0135 warning in CMake 3.24 (#71)
Add cstring include. (#70)
Contributors: Audrow Nash, Chris Lalancette, Cristóbal Arroyo, Lucas Wendland, Scott K Logan
pendulum_control
pendulum_msgs
performance_test_fixture
pluginlib
Update maintainers
Contributors: Audrow Nash
pybind11_vendor
Add a modified patch from upstream to support Python 3.11 (#22)
Add missing buildtool dependency on git (#19)
Update maintainers (#17)
Force pybind11 to find Python 3. (#15)
Mirror rolling to master
Update maintainers (#14)
Update to pybind11 2.9.1.
Rename patch file for history continuity.
Contributors: Audrow Nash, Chris Lalancette, Scott K Logan, Steven! Ragnarök, methylDragon
python_cmake_module
[rolling] Update maintainers - 2022-11-07 (#13)
Mirror rolling to master
Contributors: Audrow Nash
python_orocos_kdl_vendor
python_qt_binding
Fix to allow ninja to use make for generators (#123)
Fix flake8 linter regression (#125)
Remove pyqt from default binding order for macOS (#118)
Demote missing SIP message from WARNING to STATUS (#122)
[rolling] Update maintainers - 2022-11-07 (#120)
Contributors: Audrow Nash, Christoph Hellmann Santos, Cristóbal Arroyo, Michael Carroll, Rhys Mainwaring, Scott K Logan
qt_dotgraph
qt_gui
qt_gui_app
Add in LICENSE file
Contributors: Chris Lalancette
qt_gui_core
Add in LICENSE file
Contributors: Chris Lalancette
qt_gui_cpp
qt_gui_py_common
Add in LICENSE file
Contributors: Chris Lalancette
quality_of_service_demo_cpp
quality_of_service_demo_py
rcl
Honor ROS_LOCALHOST_ONLY if enabled. (#1071)
fix flaky test (#1063)
Add enable_type_description_service node option - API only (#1060)
Dynamic Subscription (BONUS: Allocators): rcl (#1057)
Runtime Interface Reflection: rcl (#1025)
[rcl] Improve handling of dynamic discovery (#1023)
Use get_type_hash_func for typesupports (#1055)
publish for rosout topic multiple times to avoid flaky test (#1054)
Switch to target_link_libraries in rcl. (#1051)
Calculate type hash from TypeDescription (rep2011) (#1027)
Implement matched event (#1033)
use user-defined allocator to configure logging. (#1047)
user defined allocator should be used for rosout publisher. (#1044)
Add in inconsistent_topic implementation. (#1024)
doc update, ROS message accessibility depends on RMW implementation. (#1043)
Fix some warnings from clang. (#1042)
avoid unnecessary copy for rcutils_char_array_vsprintf. (#1035)
Service introspection (#997)
Cache disable flag to avoid reading environmental variable. (#1029)
use parent logger (#921)
Add timer on reset callback (#995)
Update rcl to C++17. (#1031)
Make sure to check the return value of rcl_clock_init in tests. (#1030)
Implement rcl_clock_time_started (#1021)
Make sure to reset errors more places in the tests. (#1020) This makes it so we don’t get as many warnings when the tests are running.
[rolling] Update maintainers - 2022-11-07 (#1017)
Small cleanups to rcl (#1013)
use int64_t for period. (#1010)
fixed rcl_wait return error when timer cancelled (#1003)
remove duplicate packages in find_package and reorder (#994)
Fix buffer overflow in argument parsing caused by lexer returning length beyond length of string (#979)
Fix leak in test_subscription_content_filter_options.cpp (#978)
Contributors: Audrow Nash, Barry Xu, Brian, Chen Lihui, Chris Lalancette, Emerson Knapp, Geoffrey Biggs, Shane Loretz, Tomoya Fujita, mauropasse, methylDragon, 정찬희
rcl_action
rcl_interfaces
rcl_lifecycle
rcl_logging_interface
rcl_logging_noop
rcl_logging_spdlog
Mark the benchmark _ as unused. (#99)
Update rcl_logging to C++17. (#98)
change flushing behavior for spdlog log files, and add env var to use old style (no explicit flushing) (#95) * now flushes every ERROR message and periodically every 5 seconds * can set
RCL_LOGGING_SPDLOG_EXPERIMENTAL_OLD_FLUSHING_BEHAVIOR=1
to get old behaviorUpdated maintainers - 2022-11-07 (#96)
Disable cppcheck for rcl_logging_spdlog. (#93)
ament_export_dependencies any package with targets we linked against (#89)
Contributors: Audrow Nash, Chris Lalancette, Shane Loretz, William Woodall
rcl_yaml_param_parser
rclcpp
Add support for logging service. (#2122)
Picking ABI-incompatible executor changes (#2170)
add events-executor and timers-manager in rclcpp (#2155)
Create common structures for executors to use (#2143)
Implement deliver message kind (#2168)
applied tracepoints for ring_buffer (#2091)
Dynamic Subscription (REP-2011 Subset): Stubs for rclcpp (#2165)
Add type_hash to cpp TopicEndpointInfo (#2137)
Trigger the intraprocess guard condition with data (#2164)
Minor grammar fix (#2149)
Fix unnecessary allocations in executor.cpp (#2135)
add Logger::get_effective_level(). (#2141)
Remove deprecated header (#2139)
Implement matched event (#2105)
use allocator via init_options argument. (#2129)
Fixes to silence some clang warnings. (#2127)
Documentation improvements on the executor (#2125)
Avoid losing waitable handles while using MultiThreadedExecutor (#2109)
Hook up the incompatible type event inside of rclcpp (#2069)
Update all rclcpp packages to C++17. (#2121)
Fix clang warning: bugprone-use-after-move (#2116)
Fix memory leak in tracetools::get_symbol() (#2104)
Service introspection (#1985)
Allow publishing borrowed messages with intra-process enabled (#2108)
to fix flaky test about TestTimeSource.callbacks (#2111)
to create a sublogger while getting child of Logger (#1717)
Fix documentation of Context class (#2107)
fixes for rmw callbacks in qos_event class (#2102)
Add support for timers on reset callback (#1979)
Topic node guard condition in executor (#2074)
Fix bug on the disorder of calling shutdown callback (#2097)
Add default constructor to NodeInterfaces (#2094)
Fix clock state cached time to be a copy, not a reference. (#2092)
Fix -Wmaybe-uninitialized warning (#2081)
Fix the keep_last warning when using system defaults. (#2082)
Add in a fix for older compilers. (#2075)
Implement Unified Node Interface (NodeInterfaces class) (#2041)
Do not throw exception if trying to dequeue an empty intra-process buffer (#2061)
Move event callback binding to PublisherBase and SubscriptionBase (#2066)
Implement validity checks for rclcpp::Clock (#2040)
Explicitly set callback type (#2059)
Fix logging macros to build with msvc and cpp20 (#2063)
Add clock type to node_options (#1982)
Fix nullptr dereference in prune_requests_older_than (#2008)
Remove templating on to_rcl_subscription_options (#2056)
Fix SharedFuture from async_send_request never becoming valid (#2044)
Add in a warning for a KeepLast depth of 0. (#2048)
Mark rclcpp::Clock::now() as const (#2050)
Fix a case that did not throw ParameterUninitializedException (#2036)
Update maintainers (#2043)
MultiThreadExecutor number of threads is at least 2+ in default. (#2032)
Fix bug that a callback not reached (#1640)
Set the minimum number of threads of the Multithreaded executor to 2 (#2030)
check thread whether joinable before join (#2019)
Set cpplint test timeout to 3 minutes (#2022)
Make sure to include-what-you-use in the node_interfaces. (#2018)
Do not clear entities callbacks on destruction (#2002)
fix mismatched issue if using zero_allocate (#1995)
Make ParameterService and Sync/AsyncParameterClient accept rclcpp::QoS (#1978)
support regex match for parameter client (#1992)
operator+= and operator-= for Duration (#1988)
Revert “Revert “Add a create_timer method to Node and
LifecycleNode
classes (#1975)” (#2009) (#2010)force compiler warning if callback handles not captured (#2000)
Revert “Add a
create_timer
method toNode
andLifecycleNode
classes (#1975)” (#2009)Add a
create_timer
method toNode
andLifecycleNode
classes (#1975)[docs] add note about callback lifetime for {on, post}_set_parameter_callback (#1981)
fix memory leak (#1994)
Support pre-set and post-set parameter callbacks in addition to on-set-parameter-callback. (#1947)
Make create_service accept rclcpp::QoS (#1969)
Make create_client accept rclcpp::QoS (#1964)
Fix the documentation for rclcpp::ok to be accurate. (#1965)
use regex for wildcard matching (#1839)
Revert “Introduce executors new spin_for method, replace spin_until_future_complete with spin_until_complete. (#1821) (#1874)” (#1956)
Introduce executors new spin_for method, replace spin_until_future_complete with spin_until_complete. (#1821) (#1874)
test adjustment for LoanedMessage. (#1951)
fix virtual dispatch issues identified by clang-tidy (#1816)
Remove unused on_parameters_set_callback_ (#1945)
Fix subscription.is_serialized() for callbacks with message info (#1950)
wait for subscriptions on another thread. (#1940)
Fix documentation of
RCLCPP\_[INFO,WARN,...]
(#1943)Always trigger guard condition waitset (#1923)
Add statistics for handle_loaned_message (#1927)
Drop wrong template specialization (#1926)
Update get_parameter_from_event to follow the function description (#1922)
Add ‘best available’ QoS enum values and methods (#1920)
use reinterpret_cast for function pointer conversion. (#1919)
Contributors: Alberto Soragna, Alexander Hans, Alexis Paques, Andrew Symington, Audrow Nash, Barry Xu, Brian, Chen Lihui, Chris Lalancette, Christophe Bedard, Christopher Wecht, Cristóbal Arroyo, Daniel Reuter, Deepanshu Bansal, Emerson Knapp, Hubert Liberacki, Ivan Santiago Paunovic, Jacob Perron, Jeffery Hsu, Jochen Sprickerhof, Lei Liu, Mateusz Szczygielski, Michael Carroll, Miguel Company, Nikolai Morin, Shane Loretz, Silvio Traversaro, Tomoya Fujita, Tyler Weaver, William Woodall, Yadu, andrei, mauropasse, mergify[bot], methylDragon, schrodinbug, uupks, ymski
rclcpp_action
extract the result response before the callback is issued. (#2132)
Update all rclcpp packages to C++17. (#2121)
Fix the GoalUUID to_string representation (#1999)
Explicitly set callback type (#2059)
Update maintainers (#2043)
Do not clear entities callbacks on destruction (#2002)
Revert “Introduce executors new spin_for method, replace spin_until_future_complete with spin_until_complete. (#1821) (#1874)” (#1956)
Introduce executors new spin_for method, replace spin_until_future_complete with spin_until_complete. (#1821) (#1874)
Contributors: Audrow Nash, Chris Lalancette, Hubert Liberacki, Nathan Wiebe Neufeldt, Tomoya Fujita, William Woodall, mauropasse
rclcpp_components
Update all rclcpp packages to C++17. (#2121)
Improve component_manager_isolated shutdown (#2085)
Update maintainers (#2043)
use unique ptr and remove unuseful container (#2013)
Revert “Introduce executors new spin_for method, replace spin_until_future_complete with spin_until_complete. (#1821) (#1874)” (#1956)
Introduce executors new spin_for method, replace spin_until_future_complete with spin_until_complete. (#1821) (#1874)
Contributors: Audrow Nash, Chen Lihui, Chris Lalancette, Hubert Liberacki, Michael Carroll, William Woodall
rclcpp_lifecycle
Add support for logging service. (#2122)
Support publishing loaned messages in LifecyclePublisher (#2159)
Fixes to silence some clang warnings. (#2127)
Update all rclcpp packages to C++17. (#2121)
Use the correct macro for LifecycleNode::get_fully_qualified_name (#2117)
add get_fully_qualified_name to rclcpp_lifecycle (#2115)
Implement Unified Node Interface (NodeInterfaces class) (#2041)
Add clock type to node_options (#1982)
Update maintainers (#2043)
LifecycleNode on_configure doc fix. (#2034)
Bugfix 20210810 get current state (#1756)
Make lifecycle impl get_current_state() const. (#2031)
Cleanup the lifecycle implementation (#2027)
Cleanup the rclcpp_lifecycle dependencies. (#2021)
Revert “Revert “Add a create_timer method to Node and
LifecycleNode
classes (#1975)” (#2009) (#2010)Revert “Add a
create_timer
method toNode
andLifecycleNode
classes (#1975)” (#2009)Add a
create_timer
method toNode
andLifecycleNode
classes (#1975)Support pre-set and post-set parameter callbacks in addition to on-set-parameter-callback. (#1947)
Make create_service accept rclcpp::QoS (#1969)
Make create_client accept rclcpp::QoS (#1964)
Contributors: Andrew Symington, Audrow Nash, Chris Lalancette, Deepanshu Bansal, Ivan Santiago Paunovic, Jeffery Hsu, Lei Liu, Michael Babenko, Shane Loretz, Steve Macenski, Tomoya Fujita, methylDragon
rclpy
Logging service support (#1102)
Use custom sourcedir for conf.py (#1109)
ServerGoalHandle should be destroyed before removing. (#1113)
Fix unnecessary list comprehension flake8 (#1112)
Stub type hash value line in TopicEndpointInfo string (#1110)
Support documentation generation using rosdoc2 (#1103)
Fix Time and Duration raising exception when compared to another type (#1007)
Make rcl_interfaces a build and exec dependency. (#1100)
Solving Atomic undefined on OSX with clang (#1096)
Implement matched event (#1083)
Update service.py documentation (#1094)
Allow space or empty strings when using ros2 param set (#1093)
Hook up the incompatible type event inside of rclpy (#1058)
Switch to using module instead of module_ (#1090)
Add in subscription.get_publisher_count() (#1089)
Service introspection (#988)
to create a sublogger while getting child of Logger (#1084)
Fix #983 by saving future and checking for + raising any exceptions (#1073)
Force C++17 support on. (#1076)
Use RCPPUTILS_SCOPE_EXIT to cleanup unparsed_indices_c. (#1075)
Explicitly link atomic when building with Clang (#1065)
Fix test_publisher linter for pydocstyle 6.2.2 (#1063)
Add default preset qos profile (#1062)
Add on_parameter_event method to the AsyncParameterClient. (#1061)
Add documentation page for rclpy.clock (#1055)
Rewrite test code without depending on parameter client (#1045)
Add parallel callback test (#1044)
decorator should not be callable. (#1050)
typo fix. (#1049)
Add in a warning for a depth of 0 with KEEP_LAST. (#1048)
Document rclpy.time.Time class (#1040)
Deal with ParameterUninitializedException for parameter service (#1033)
Improve documentation in rclpy.utilities (#1038)
Document rclpy.utilities.remove_ros_args (#1036)
Fix incorrect comparsion on whether parameter type is NOT_SET (#1032)
[rolling] Update maintainers (#1035)
Set the default number of threads of the MultiThreadedExecutor to 2 (#1031)
Update the rclpy method documentation. (#1026)
Revert “Raise user handler exception in MultiThreadedExecutor. (#984)” (#1017)
Waitable should check callback_group if it can be executed. (#1001)
support wildcard matching for params file (#987)
Raise user handler exception in MultiThreadedExecutor. (#984)
Add wait_for_node method (#930)
Create sublogger for action server and action client (#982)
Support for pre-set and post-set parameter callback. (#966)
fix gcc 7.5 build errors (#977)
make _on_parameter_event return result correctly (#817)
Fix a small typo in documentation. (#967)
Add Parameter Client (#959)
Change sphinx theme to readthedocs (#950)
Name and type in descriptor(s) is ignored via declare_parameter(s). (#957)
Typo fix (#951)
Add py.typed to package (#946)
Fix rclpy.shutdown() from hanging when triggered from callback (#947)
Check if the context is already shutdown. (#939)
Avoid causing infinite loop when message is empty (#935)
Expose ‘best available’ QoS policies (#928)
remove feedback callback when the goal has been completed. (#927)
Allow to create a subscription with a callback that also receives the message info (#922)
Contributors: Achille Verheye, Audrow Nash, Barry Xu, Brian, Brian Chen, Chen Lihui, Chris Lalancette, Cristóbal Arroyo, Deepanshu Bansal, Emerson Knapp, Erki Suurjaak, Felix Divo, Florian Vahl, Gonzo, GuiHome, Ivan Santiago Paunovic, Jacob Perron, Lei Liu, Lucas Wendland, Michael Carroll, Sebastian Freitag, Seulbae Kim, Shane Loretz, Steve Nogar, Takeshi Ishita, Tomoya Fujita, Tony Najjar, Yadu, Yuki Igarashi, mergify[bot]
rcpputils
Add missing header for strlen (#169)
issue-167 (#172)
[rolling] Update maintainers - 2022-11-07 (#166)
require C++17 and deprecate the rcppmath namespace (#165)
Mirror rolling to master
Fix possible race condition in create_directories() (#162)
Contributors: Artem Shumov, Audrow Nash, Sebastian Freitag, William Woodall, bijoua29
rcutils
fix memory leak (#423)
Add convenience error handling macros (#421)
Calculate the next power-of-two for the user in hash_map_init. (#420)
update cast to modern style (#418)
Remove deprecated header get_env.h (#417)
Updates to rcutils to make rosdoc2 generation happier. (#416)
add RCUTILS_LOGGING_AUTOINIT_WITH_ALLOCATOR. (#415)
Fix memory leak in string_map.c in rcutils (#411)
avoid unnecessary copy for rcutils_char_array_vsprintf. (#412)
Add missing stddef include for size_t (#410)
Add SHA256 utility implementation (#408)
Upgrade rcutils to C++17. (#392)
[rolling] Update maintainers - 2022-11-07 (#404)
Fix build on OpenHarmony (#395)
regression of thread-safety for logging macros (#393)
add portable nonnull macros (#382)
Fix memory leak when adding the same key to the logger hash map multiple times (#391)
time_unix: uses ZEPHYR_VERSION_CODE instead (#390)
Cleanup time_unix.c (#389)
time_unix: namespace zephyr headers (#383)
Restrict overmatching MACH ifdef to only trigger on OSX and Mach (#386)
Optimize rcutils_logging_get_logger_effective_level() (#381)
Change syntax __VAR_ARGS__ to __VA_ARGS__ (#376)
Fix a bug in hash_map_get_next_key_and_data. (#375)
More fixes from review.
Fixes from review.
Make g_rcutils_logging_output_handler static.
Make g_rcutils_logging_default_logger_level static.
Optimize rcutils_find_lastn where possible.
Don’t bother computing the hash_map key if the hash map is empty.
Make sure to expand char_array by at least 1.5x.
Optimize index computation in hash_map_find.
Improve the performance of rcutils_logging_format_message. (#372)
Get rid of unnecessary ret variable.
Get rid of unnecessary ifdef cplusplus checks in the C file.
Get rid of unnecessary rcutils_custom_add_{gtest,gmock}
Get rid of unnecessary and unused RMW switching for logging tests.
Remove unnecessary IS_OUTPUT_COLORIZED macro.
Rename logging internal structures to use our new convention.
Make all of the logging ‘expand’ methods static.
Fix up error checking for RCUTILS_CONSOLE_STDOUT_LINE_BUFFERED.
Cleanup error handling for the RCUTILS_CONSOLE_OUTPUT_FORMAT checks.
Revamp error handling in rcutils_logging_initialize_with_allocator.
Revamp rcutils_logging_initialize_with_allocator.
Make a few logging global variables static.
Optimize calls via the RCUTILS_LOG macros. (#369)
time_unix: add zephyr posix time (#368)
Optimize the implementation of rcutils_char_array_strncpy. (#367)
strdup.c: fix arbitrary length overread (#366)
Mirror rolling to master
strdup.c: fix 1 byte buffer overread (#363)
Clarify duration arg description in logging macros (#359)
Update rcutils_steady_time_now to return the same data as std::chrono (#357)
Contributors: AIxWall, Abrar Rahman Protyasha, Audrow Nash, Chen Lihui, Chris Lalancette, Emerson Knapp, Felipe Neves, Jacob Perron, Mario Prats, Maximilian Downey Twiss, Nikolai Morin, Tomoya Fujita, William Woodall, Yakumoo, guijan, methylDragon
rmw
Dynamic Subscription (BONUS: Allocators): rmw (#353)
Runtime Interface Reflection: rmw (#340)
[rmw] Improve handling of dynamic discovery (#338)
rmw_send_reqponse returns RMW_RET_TIMEOUT. (#350)
Add a note about asynchronicity of discovery. (#352)
Add matched event support (#331)
Add type hash to rmw_topic_endpoint_info_t (rep2011) (#348)
Add in inconsistent topic defines and data structures. (#339)
Update documented expectations for GIDs (#335)
Fix rmw->rwm typo (#347)
Add rmw count clients, services (#334)
make writer_guid uint8_t[] instead of int8_t for consistency with rmw_gid_t (#329)
Update rmw to C++17. (#346)
Reduce GID storage to 16 bytes. (#345)
Move the RMW_CHECK_TYPE_IDENTIFIERS_MATCH macro to a C header. (#343)
[rolling] Update maintainers - 2022-11-07 (#337)
Remove unused test_loaned_message_sequence.cpp (#336)
callback can be NULL to clear in Listener APIs. (#332)
Add rmw_get_gid_for_client method (#327)
Add ‘best available’ QoS policies (#320) The best available policy should select the highest level of service for the QoS setting while matching with the majority of endpoints. For example, in the case of a DDS middleware subscription, this means: * Prefer reliable reliability if all existing publishers on the same topic are reliable, otherwise use best effort. * Prefer transient local durability if all existing publishers on the same topic are transient local, otherwise use volatile. * Prefer manual by topic liveliness if all existing publishers on the same topic are manual by topic, otherwise use automatic. * Use a deadline that is equal to the largest deadline of existing publishers on the same topic. * Use a liveliness lease duration that is equal to the largest lease duration of existing publishers on the same topic.
Move statuses definitions to rmw/events_statuses/ (#232)
Contributors: Audrow Nash, Barry Xu, Brian, Chris Lalancette, Emerson Knapp, Geoffrey Biggs, Jacob Perron, Lee, Minju, Nikolai Morin, Tomoya Fujita, William Woodall, methylDragon
rmw_connextdds
Dynamic Subscription (BONUS: Allocators): rmw_connextdds (#115)
Revert “Refactor serialization support to use allocators and refs”
Refactor serialization support to use allocators and refs
Add stubs for new rmw interfaces (#111)
Add rmw_get_gid_for_client impl (#92)
Switch ROS2 -> ROS 2 everywhere (#83)
Contributors: Brian, Chris Lalancette, methylDragon
rmw_connextdds_common
[rmw_connextdds] New RMW discovery options (#108)
Call get_type_hash_func (#113)
Type hash distribution during discovery (rep2011) (#104)
Implement matched event (#101)
Add in implementation of inconsistent topic. (#103)
Add rmw_get_gid_for_client impl (#92)
Fix assert statement to allow the seconds field of a DDS_Duration_t to be zero (#88)
Handle ‘best_available’ QoS policies in common (#85)
Resolve build error with RTI Connext DDS 5.3.1 (#82)
Contributors: Andrea Sorbini, Barry Xu, Brian, Chris Lalancette, Emerson Knapp, Grey, Jose Luis Rivero, Michael Carroll, Michael Jeronimo
rmw_connextddsmicro
rmw_cyclonedds_cpp
Dynamic Subscription (BONUS: Allocators): rmw_cyclonedds (#451)
Add stubs for new rmw interfaces (#447)
[rmw_cyclonedds] Improve handling of dynamic discovery (#429)
Call get_type_hash_func (#448)
Type hash distribution in discovery (rep2011) (#437)
Disable inconsistent topic events. (#444)
Implement matched event (#435)
Implement inconsistent topic. (#431)
Make sure to add semicolons to the CHECK_TYPE_IDENTIFIER_MATCH. (#432)
[rolling] Update maintainers - 2022-11-07 (#428)
Export CycloneDDS dependency (#424)
add NULL check before accessing object. (#423)
Add rmw_get_gid_for_client impl (#402)
Makes topic_name a const ref
Adds topic name to error msg when create_topic fails
Improve error message when create_topic fails (#405)
Change wrong use of %d to print uint32_t to PRIu32 (#253)
Add cstring include. (#393)
Handle ‘best_available’ QoS policies (#389)
Contributors: Audrow Nash, Barry Xu, Brian, Chris Lalancette, Emerson Knapp, Geoffrey Biggs, Jose Luis Rivero, Shane Loretz, Tomoya Fujita, Tully Foote, Voldivh, eboasson, methylDragon
rmw_dds_common
Type hash in GraphCache, user_data encoding tools (#70)
Mark benchmark _ as unused. (#71)
Update rmw_dds_common to C++17. (#69)
Change Gid.msg to be 16 bytes. (#68)
Minor cleanups of test_qos. (#67)
[rolling] Update maintainers - 2022-11-07 (#65)
build shared lib only if BUILD_SHARED_LIBS is set (#62)
Update maintainers (#61)
Add functions for resolving ‘best available’ QoS policies (#60) Given a QoS profile and set of endpoints for the same topic, overwrite any policies set to BEST_AVAILABLE with a policy such that it matches all endpoints while maintaining a high level of service. Add testable functions for updating BEST_AVAILABLE policies, * qos_profile_get_best_available_for_subscription * qos_profile_get_best_available_for_publisher and add convenience functions that actual query the graph for RMW implementations to use, * qos_profile_get_best_available_for_topic_subscription * qos_profile_get_best_available_for_topic_publisher
Contributors: Audrow Nash, Chris Lalancette, Emerson Knapp, Jacob Perron, hannes09, methylDragon
rmw_fastrtps_cpp
Dynamic Subscription (BONUS: Allocators): rmw_fastrtps (#687)
Runtime Interface Reflection: rmw_fastrtps (#655)
[rmw_fastrtps] Improve handling of dynamic discovery (#653)
Call get_type_hash_func (#680)
Type hash distribution in discovery (rep2011) (#671)
Implement inconsistent topic event (#654)
Update all rmw_fastrtps packages to C++17. (#674)
Rewrite how Topics are tracked in rmw_fastrtps_cpp. (#669)
Allow loaned messages without data-sharing (#568)
Fix incoherent dissociate_writer to dissociate_reader (#647) (#649)
[rolling] Update maintainers - 2022-11-07 (#643)
Add rmw_get_gid_for_client impl (#631)
Use Fast-DDS Waitsets instead of listeners (#619)
Remove rosidl_cmake dependency (#629)
Revert “add line feed for RCUTILS_SAFE_FWRITE_TO_STDERR (#608)” (#612)
add line feed for RCUTILS_SAFE_FWRITE_TO_STDERR (#608)
Allow null arguments in the EventsExecutor parameters (#602)
Add RMW_CHECKS to rmw_fastrtps_cpp EventsExecutor implementation
Handle ‘best_available’ QoS policies (#598)
Contributors: Audrow Nash, Brian, Chris Lalancette, Emerson Knapp, Geoffrey Biggs, Jacob Perron, Jose Luis Rivero, Miguel Company, Oscarchoi, Ricardo González, Tomoya Fujita, methylDragon
rmw_fastrtps_dynamic_cpp
Dynamic Subscription (BONUS: Allocators): rmw_fastrtps (#687)
Runtime Interface Reflection: rmw_fastrtps (#655)
[rmw_fastrtps] Improve handling of dynamic discovery (#653)
Call get_type_hash_func (#680)
Type hash distribution in discovery (rep2011) (#671)
Implement inconsistent topic event (#654)
Update all rmw_fastrtps packages to C++17. (#674)
Rewrite how Topics are tracked in rmw_fastrtps_cpp. (#669)
Allow loaned messages without data-sharing (#568)
Fix incoherent dissociate_writer to dissociate_reader (#647) (#649)
[rolling] Update maintainers - 2022-11-07 (#643)
Add rmw_get_gid_for_client impl (#631)
Use Fast-DDS Waitsets instead of listeners (#619)
Revert “add line feed for RCUTILS_SAFE_FWRITE_TO_STDERR (#608)” (#612)
add line feed for RCUTILS_SAFE_FWRITE_TO_STDERR (#608)
Allow null arguments in the EventsExecutor parameters (#602)
Add EventExecutor to rmw_fastrtps_dynamic_cpp
Fix cpplint error (#601)
Handle ‘best_available’ QoS policies (#598)
Contributors: Audrow Nash, Brian, Chris Lalancette, Emerson Knapp, Geoffrey Biggs, Jacob Perron, Jose Luis Rivero, Miguel Company, Oscarchoi, Ricardo González, Tomoya Fujita, methylDragon
rmw_implementation
Dynamic Subscription (BONUS: Allocators): rmw_implementation (#219)
Runtime Interface Reflection: rmw_implementation (#215)
Mark the benchmark _ variables as unused. (#218)
Update rmw_implementation to C++17. (#214)
[rolling] Update maintainers - 2022-11-07 (#212)
Build-time RMW selection does not need ament_index_cpp (#210)
Add rmw_get_gid_for_client & tests (#206)
Contributors: Audrow Nash, Brian, Chris Lalancette, G.A. vd. Hoorn, methylDragon
rmw_implementation_cmake
[rolling] Update maintainers - 2022-11-07 (#337)
Contributors: Audrow Nash
robot_state_publisher
ros2action
ros2bag
Enable document generation using rosdoc2 for ament_python pkgs (#1260)
CLI: Get storage-specific values from plugin (#1209)
Fix up some of the wording in the record help text. (#1228)
Add topic_name option to info verb (#1217)
rosbag2_storage: set MCAP as default plugin (#1160)
rosbag2_py: parametrize tests across storage plugins (#1203)
Added option to change node name for the recorder from the Python API (#1180)
rosbag2_cpp: test more than one storage plugin (#1196)
rosbag2_storage: expose default storage ID as method (#1146)
Fix for ros2 bag play exit with non-zero code on SIGINT (#1126)
ros2bag: move storage preset validation to sqlite3 plugin (#1135)
Add option to prevent message loss while converting (#1058)
Added support for excluding topics via regular expressions (#1046)
Readers/info can accept a single bag storage file, and detect its storage id automatically (#1072)
Add short -v option to ros2 bag list for verbose (#1065)
Use a single variable for evaluating the filter regex (#1053)
Add additional mode of publishing sim time updates triggered by replayed messages (#1050)
Renamed –topics-regex to –regex and -e in Player class to be consistent with Recorder (#1045)
Use first available writer in recording if default
sqlite3
not available. (#1044)Add the ability to record any key/value pair in ‘custom’ field in metadata.yaml (#1038)
Added support for filtering topics via regular expressions on Playback (#1034)
Fix incorrect boundary check for
playback_duration
andplay_until_timestamp
(#1032)Adds play until timestamp functionality (#1005)
Add CLI verb for burst mode of playback (#980)
Add play-for specified number of seconds functionality (#960)
Make unpublished topics unrecorded by default (#968)
Contributors: Agustin Alba Chicar, Chris Lalancette, DensoADAS, Emerson Knapp, EsipovPA, Esteve Fernandez, Geoffrey Biggs, Hunter L.Allen, Keisuke Shima, Michael Orlov, Sean Kelly, Tony Peng, Yadu, james-rms, kylemarcey, mergify[bot], ricardo-manriquez
ros2cli
Set automatically_declare_parameters_from_overrides in DirectNode. (#813)
Enable document generation using rosdoc2 (#811)
Fix linters (#808)
add timeout option for ros2param to find node. (#802)
Save method list via connection check to XMLRPC server. (#796)
ZSH argcomplete: call compinit only if needed (#750)
Fix network aware node issue (#785)
[rolling] Update maintainers - 2022-11-07 (#776)
XMLRPC server accepts request from all local IP addresses. (#729)
Contributors: Audrow Nash, Chris Lalancette, Cristóbal Arroyo, Ivan Santiago Paunovic, Tomoya Fujita, Yadu, mjbogusz
ros2cli_common_extensions
ros2cli_test_interfaces
ros2component
ros2doctor
Shutdown ros2doctor hello when ctrl-c is received (#829)
Make all of the dependencies in pure Python packages exec_depend. (#823)
Enable document generation using rosdoc2 (#811) * Fix warnings for ros2component, ros2doctor, ros2interface, and ros2node
[rolling] Update maintainers - 2022-11-07 (#776)
Contributors: Audrow Nash, Chris Lalancette, Michael Carroll, Yadu
ros2interface
ros2launch
[rolling] Update maintainers - 2022-11-07 (#331)
Contributors: Audrow Nash
ros2lifecycle
ros2lifecycle_test_fixtures
ros2multicast
ros2node
Make all of the dependencies in pure Python packages exec_depend. (#823)
Enable document generation using rosdoc2 (#811) * Fix warnings for ros2component, ros2doctor, ros2interface, and ros2node
Fix linters (#808)
add timeout option for ros2param to find node. (#802)
[rolling] Update maintainers - 2022-11-07 (#776)
Updated wording in list.py (#775)
Contributors: Audrow Nash, Chris Lalancette, Cristóbal Arroyo, Michael Wrock, Tomoya Fujita, Yadu
ros2param
remove deprecated options (#824)
Make all of the dependencies in pure Python packages exec_depend. (#823)
add timeout option for ros2param to find node. (#802)
Fix printing of integer and double arrays. (#804)
[rolling] Update maintainers - 2022-11-07 (#776)
refactor: make ros2param use rclpy.parameter_client (#716)
Contributors: Audrow Nash, Brian, Chris Lalancette, Tomoya Fujita
ros2pkg
ros2run
ros2service
ros2test
[rolling] Update maintainers - 2022-11-07 (#12)
update maintainer
Contributors: Audrow Nash, Dharini Dutia, quarkytale
ros2topic
remove deprecated options (#824)
Make all of the dependencies in pure Python packages exec_depend. (#823)
Expect type hash cli output in test (#822)
Fix the type annotation in pub.py. (#814)
Switch to using new event_handler instead of qos_event. (#787)
avoid flaky test that subscriber might not receive the message (#810)
Adds a
--max-wait-time
option toros2 topic pub
(#800)Fix some flake8 warnings related to style. (#805)
Adds a timeout feature to rostopic echo (#792)
Refactor common types (#791)
Allow configuring liveliness in ros2 topic echo and pub (#788)
Extend timeout to shutdown the command line process. (#783)
[rolling] Update maintainers - 2022-11-07 (#776)
a couple of typo fixes. (#774)
Add support use_sim_time for ros2 topic hz/bw/pub. (#754)
Use set_message_fields from rosidl_runtime_py (#761)
Expand auto to the current time when passed to a Header field (#749)
Add verbose option to echo that also prints the associated message info (#707)
update docs for bandwidth functions. (#709)
Split the bandwidth functions into a get and print. (#708)
Contributors: Arjo Chakravarty, Audrow Nash, Chen Lihui, Chris Lalancette, Emerson Knapp, Esteve Fernandez, Ivan Santiago Paunovic, Lei Liu, Tomoya Fujita
ros2trace
ros_testing
[rolling] Update maintainers - 2022-11-07 (#12)
update maintainer
Contributors: Audrow Nash, Dharini Dutia, quarkytale
rosbag2
rosbag2_compression
Fix warning from ClassLoader in sequential compression reader and writer (#1299) (#1316)
Add message definition read API (#1292)
rosbag2_storage: add type description hash to topic metadata (#1272)
rosbag2_cpp: move local message definition source out of MCAP plugin (#1265)
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
set_read_order: return success (#1177)
Add
update_metadata(BagMetadata)
API for storage plugin interface (#1149)Reverse read order API and sqlite storage implementation (#1083)
Add option to prevent message loss while converting (#1058)
set default metadata of compressed message (in case compressor does not set it) (#1060)
Speed optimization: Preparing copyless publish/subscribing by using const message for writing (#1010)
Add the ability to record any key/value pair in ‘custom’ field in metadata.yaml (#1038)
Contributors: Chris Lalancette, Daisuke Nishimatsu, DensoADAS, Emerson Knapp, Hunter L. Allen, Joshua Hampp, Michael Orlov, Tony Peng, james-rms, mergify[bot]
rosbag2_compression_zstd
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
Speed optimization: Preparing copyless publish/subscribing by using const message for writing (#1010)
Contributors: Chris Lalancette, Daisuke Nishimatsu, DensoADAS, Joshua Hampp, Michael Orlov
rosbag2_cpp
Add type_hash in MessageDefinition struct (#1296)
Add message definition read API (#1292)
rosbag2_storage: add type description hash to topic metadata (#1272)
Fix for flaky
TimeControllerClockTest::unpaused_sleep_returns_true
test (#1290)rosbag2_cpp: move local message definition source out of MCAP plugin (#1265)
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
Fix rwm->rmw spelling (#1249)
Expose more Writer methods in python interface (#1220)
rosbag2_storage: set MCAP as default plugin (#1160)
Parametrize all rosbag2_tests for both supported storage plugins (#1221)
rosbag2_cpp: test more than one storage plugin (#1196)
Replace language for “db3”/”db”/”database” (#1194)
set_read_order: return success (#1177)
Remove explicit sqlite3 from code (#1166)
Add
update_metadata(BagMetadata)
API for storage plugin interface (#1149)Reader and writer can use default storage by not specifying (#1167)
rosbag2_storage: expose default storage ID as method (#1146)
Don’t reopen file for every seek if we don’t have to. Search directionally for the correct file (#1117)
Add SplitBagfile recording service. (#1115)
Reverse read order API and sqlite storage implementation (#1083)
Replace
std::filesystem::path(..)
withrcpputils::fs::path(..)
(#1104)Fix issue where sequentialwriter only sets metadata duration to the duration of the final file (#1098)
Delete obsolete compression_options.cpp from rosbag2_cpp (#1078)
Readers/info can accept a single bag storage file, and detect its storage id automatically (#1072)
Remove deprecated rosbag2_cpp/storage_options.hpp, for post-Humble releases (#1064)
Speed optimization: Preparing copyless publish/subscribing by using const message for writing (#1010)
Add the ability to record any key/value pair in ‘custom’ field in metadata.yaml (#1038)
Notification of significant events during bag recording and playback (#908)
Bugfix for “Playing the bags recorded with split by duration/size is playing only the last recorded .db3.” (#1022)
Improve test_time_controller test (#1012)
Contributors: Chris Lalancette, Daisuke Nishimatsu, DensoADAS, Emerson Knapp, Geoffrey Biggs, Hunter L. Allen, Jorge Perez, Joshua Hampp, Kaju-Bubanja, Michael Orlov, Tony Peng, james-rms, mergify[bot], rshanor
rosbag2_examples_cpp
rosbag2_storage: add type description hash to topic metadata (#1272)
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
Add API samples on main branch - Rolling C++ API examples (#1068)
Contributors: Chris Lalancette, Daisuke Nishimatsu, Emerson Knapp, Michael Orlov, james-rms
rosbag2_examples_py
Add API samples for Python [rebased] (#1253) * Add API samples for Python * Package Renaming and Move * linting + copyright * more linting ——— Co-authored-by: Geoffrey Biggs <gbiggs@killbots.net>
Contributors: David V. Lu!!, mergify[bot]
rosbag2_interfaces
Update rosbag2 to C++17. (#1238)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
Add SplitBagfile recording service. (#1115)
Adds stop operation for rosbag2::Player (#1007)
Notification of significant events during bag recording and playback (#908)
Adds play until timestamp functionality (#1005)
Add CLI verb for burst mode of playback (#980)
Add play-for specified number of seconds functionality (#960)
Contributors: Agustin Alba Chicar, Chris Lalancette, Geoffrey Biggs, Michael Orlov, Misha Shalem, rshanor
rosbag2_performance_benchmarking
Add tests for rosbag2_performance_benchmarking pkg (#1268)
Fix expectations for rosbag2 return code in rosbag2_performance_benchmarking (#1267)
Update rosbag2 to C++17. (#1238)
Use thread pool to run benchmark publishers in rosbag2_performance_benchmarking (#1250)
Use target_link_libraries instead of ament_target_dependencies (#1202)
Skip ament_package() call when not building rosbag2_performance_benchmarking (#1242)
Add option to specify a message type (#1153)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
Replace language for “db3”/”db”/”database” (#1194)
Remove explicit sqlite3 from code (#1166)
Contributors: Chris Lalancette, Daisuke Nishimatsu, Emerson Knapp, Michael Orlov, Shane Loretz, carlossvg
rosbag2_performance_benchmarking_msgs
rosbag2_py
Add type_hash in MessageDefinition struct (#1296)
Store message definitions in SQLite3 storage plugin (#1293)
Add message definition read API (#1292)
rosbag2_storage: add type description hash to topic metadata (#1272)
rosbag2_cpp: move local message definition source out of MCAP plugin (#1265)
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
Expose more Writer methods in python interface (#1220)
rosbag2_storage: set MCAP as default plugin (#1160)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
rosbag2_py: parametrize tests across storage plugins (#1203)
Added option to change node name for the recorder from the Python API (#1180)
Replace language for “db3”/”db”/”database” (#1194)
Remove explicit sqlite3 from code (#1166)
Move python get_default_storage_id to storage module instead of writer (#1165)
rosbag2_storage: expose default storage ID as method (#1146)
rosbag2_py: set defaults for config when bag rewriting (#1121)
Reverse read order API and sqlite storage implementation (#1083)
expose py Reader metadata, improve
rosbag2_py.BagMetadata
usability (#1082)Added support for excluding topics via regular expressions (#1046)
Use a single variable for evaluating the filter regex (#1053)
Add additional mode of publishing sim time updates triggered by replayed messages (#1050)
Renamed –topics-regex to –regex and -e in Player class to be consistent with Recorder (#1045)
Add the ability to record any key/value pair in ‘custom’ field in metadata.yaml (#1038)
Added support for filtering topics via regular expressions on Playback (#1034)
Adds play until timestamp functionality (#1005)
Add CLI verb for burst mode of playback (#980)
Add play-for specified number of seconds functionality (#960)
Make unpublished topics unrecorded by default (#968)
Fix test rosbag2_py test compatibility with Python < 3.8 (#987)
Contributors: Agustin Alba Chicar, Chris Lalancette, Daisuke Nishimatsu, Emerson Knapp, Esteve Fernandez, Geoffrey Biggs, Hunter L. Allen, Michael Orlov, Scott K Logan, Sean Kelly, Tony Peng, james-rms, kylemarcey, mergify[bot], ricardo-manriquez
rosbag2_storage
Add type_hash in MessageDefinition struct (#1296)
Add message definition read API (#1292)
rosbag2_storage: add type description hash to topic metadata (#1272)
rosbag2_cpp: move local message definition source out of MCAP plugin (#1265)
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
rosbag2_storage: set MCAP as default plugin (#1160)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
set_read_order: return success (#1177)
Remove explicit sqlite3 from code (#1166)
Add
update_metadata(BagMetadata)
API for storage plugin interface (#1149)rosbag2_storage: expose default storage ID as method (#1146)
Don’t reopen file for every seek if we don’t have to. Search directionally for the correct file (#1117)
Reverse read order API and sqlite storage implementation (#1083)
Remove YAML_CPP_DLL define (#964)
Added support for excluding topics via regular expressions (#1046)
Readers/info can accept a single bag storage file, and detect its storage id automatically (#1072)
Use a single variable for evaluating the filter regex (#1053)
Speed optimization: Preparing copyless publish/subscribing by using const message for writing (#1010)
Renamed –topics-regex to –regex and -e in Player class to be consistent with Recorder (#1045)
Add the ability to record any key/value pair in ‘custom’ field in metadata.yaml (#1038)
Added support for filtering topics via regular expressions on Playback (#1034)
Contributors: Akash, Chris Lalancette, Daisuke Nishimatsu, DensoADAS, Emerson Knapp, Esteve Fernandez, Hunter L. Allen, Joshua Hampp, Michael Orlov, Tony Peng, james-rms
rosbag2_storage_default_plugins
rosbag2_storage: set MCAP as default plugin (#1160)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
Move sqlite3 storage implementation to rosbag2_storage_sqlite3 package (#1113)
Reverse read order API and sqlite storage implementation (#1083)
Add support for old db3 schema used on distros prior to Foxy (#1090)
Added support for excluding topics via regular expressions (#1046)
Contributors: Emerson Knapp, Esteve Fernandez, Michael Orlov, james-rms
rosbag2_storage_mcap
Add type_hash in MessageDefinition struct (#1296)
Add message definition read API (#1292)
rosbag2_storage: add type description hash to topic metadata (#1272)
rosbag2_cpp: move local message definition source out of MCAP plugin (#1265)
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
CLI: Get storage-specific values from plugin (#1209)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
rosbag2_cpp: test more than one storage plugin (#1196)
set_read_order: return success (#1177)
rosbag2_storage_mcap: merge into rosbag2 repo (#1163)
mcap_storage: ‘none’ is a valid storage preset profile (#86)
mcap_storage: handle update_metadata call (#83)
Update clang-format rules to fit ROS 2 style guide (#80)
Revert “read_order: throw exception from set_read_order for unsupported orders”
read_order: throw exception from set_read_order for unsupported orders
Fix compile flags to work on rosbag_storage:0.17.x (#78)
Fix Windows build (#73)
set defaults for SQLite plugin parity (#68)
rosbag2_storage_mcap: add storage preset profiles (#57)
rename test_fixture_interfaces package to testdata (#64)
Switch to using the vendored zstd library. (#59)
Add set_read_order reader API (#54)
Some minor improvements in rosbag2_storage_mcap after review (#58)
Revert “rosbag2_storage_mcap: add storage preset profiles”
rosbag2_storage_mcap: add storage preset profiles
Store IDL message definitions in Schema records when no MSG definition is available (#43)
Support timestamp-ordered playback (#50)
Support regex topic filtering
Add all lz4 sources to fix undefined symbols at runtime (#46)
Upgrade mcap to fix LZ4 error and segfault (#42)
Fix build for Foxy (#34)
fix: minor issues (#31) * remove unnecessary block * use target_link_libraries instead of ament_target_dependencies * remove ros environment * add prefix to compile definition
Update email address for Foxglove maintainers (#32)
Added mcap_vendor package. Updated CMakeLists.txt to fetch dependencies with FetchContent rather than Conan.
CMake build script will now execute pip install conan automatically.
[1.0.0] Use Summary section for get_metadata() and seek(), implement remaining methods (#17)
feat: add play impl (#16)
chore: refine package.xml (#15)
Don’t throw when READ_WRITE mode is used; add .mcap file extension to recorded files (#14)
Add dynamic message definition lookup (#13)
Switch C++ formatter to clang-format (#12)
Merge pull request #7 from ros-tooling/jhurliman/reader-writer
uninitialized struct
lint
lint
lint
Reader and writer implementation
Merge pull request #6 from wep21/add-metadata-impl
feat: add metadata impl
Merge pull request #5 from wep21/mcap-storage-impl
chore: update cmake minimum version
chore: install mcap header
chore: include mcap header
fix: move fetch content into rosbag2 storage mcap
Merge pull request #3 from ros-tooling/emersonknapp/mcap_plugin_skeleton
Add rosbag2_storage_mcap skeleton
Contributors: Andrew Symington, Chris Lalancette, Daisuke Nishimatsu, Emerson Knapp, Jacob Bandes-Storch, James Smith, John Hurliman, Michael Orlov, james-rms, wep21
rosbag2_storage_sqlite3
Add type_hash in MessageDefinition struct (#1296)
Store message definitions in SQLite3 storage plugin (#1293)
Add message definition read API (#1292)
rosbag2_storage: add type description hash to topic metadata (#1272)
rosbag2_cpp: move local message definition source out of MCAP plugin (#1265)
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
CLI: Get storage-specific values from plugin (#1209)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
Remove sqlite3-specific info from main README, make it more storage agnostic and point to plugin-specific README (#1193)
set_read_order: return success (#1177)
Add
update_metadata(BagMetadata)
API for storage plugin interface (#1149)Store db schema version and ROS_DISTRO name in db3 files (#1156)
ros2bag: move storage preset validation to sqlite3 plugin (#1135)
Move sqlite3 storage implementation to rosbag2_storage_sqlite3 package (#1113)
Use a single variable for evaluating the filter regex (#1053)
Renamed –topics-regex to –regex and -e in Player class to be consistent with Recorder (#1045)
Added support for filtering topics via regular expressions on Playback (#1034)
Contributors: Chris Lalancette, Daisuke Nishimatsu, Emerson Knapp, Esteve Fernandez, Michael Orlov, james-rms
rosbag2_test_common
Address flakiness in rosbag2_play_end_to_end tests (#1297) (#1330)
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
rosbag2_py: parametrize tests across storage plugins (#1203)
Fix for ros2 bag play exit with non-zero code on SIGINT (#1126)
Split up the include of rclcpp.hpp (#1027)
Contributors: Chris Lalancette, Daisuke Nishimatsu, Michael Orlov, james-rms, mergify[bot]
rosbag2_test_msgdefs
rosbag2_cpp: move local message definition source out of MCAP plugin (#1265) The intention of this PR is to move the message-definition-finding capability outside of rosbag2_storage_mcap, and allow any rosbag2 storage plugin to store message definitions.
Contributors: james-rms
rosbag2_tests
Address flakiness in rosbag2_play_end_to_end tests (#1297) (#1330)
Add type_hash in MessageDefinition struct (#1296)
rosbag2_cpp: move local message definition source out of MCAP plugin (#1265)
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
rosbag2_storage: set MCAP as default plugin (#1160)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
Parametrize all rosbag2_tests for both supported storage plugins (#1221)
Make rosbag2_tests agnostic to storage implementation (#1192)
Get rid from attempt to open DB file in
wait_for_db()
test fixture (#1141)Fix for ros2 bag play exit with non-zero code on SIGINT (#1126)
Move sqlite3 storage implementation to rosbag2_storage_sqlite3 package (#1113)
Readers/info can accept a single bag storage file, and detect its storage id automatically (#1072)
Add the ability to record any key/value pair in ‘custom’ field in metadata.yaml (#1038)
Contributors: Chris Lalancette, Daisuke Nishimatsu, Emerson Knapp, Hunter L. Allen, Michael Orlov, Tony Peng, james-rms, mergify[bot]
rosbag2_transport
Change subscriptions from GenericSubscripton to SubscriptionBase (#1338)
Read message definitions from input files in bag_rewrite (#1295)
Add message definition read API (#1292)
Move rosbag2_transport::Recorder implementation to pimpl (#1291)
rosbag2_storage: add type description hash to topic metadata (#1272)
rosbag2_cpp: move local message definition source out of MCAP plugin (#1265)
Use RMW methods to initialize endpoint info instead of brace initializer to guard against upcoming struct change (#1257)
Update rosbag2 to C++17. (#1238)
Use target_link_libraries instead of ament_target_dependencies (#1202)
Print “Hidden topics are not recorded” only once. (#1225)
rosbag2_storage: set MCAP as default plugin (#1160)
Add Michael Orlov as maintainer in rosbag2 packages (#1215)
rosbag2_transport: parametrize test_rewrite (#1206)
rosbag2_cpp: test more than one storage plugin (#1196)
Replace language for “db3”/”db”/”database” (#1194)
set_read_order: return success (#1177)
Remove explicit sqlite3 from code (#1166)
Add pause and resume service calls for rosbag2 recorder (#1131)
Redesign record_services tests to make them more deterministic (#1122)
Add SplitBagfile recording service. (#1115)
Reverse read order API and sqlite storage implementation (#1083)
make recorder node composable by inheritance (#1093)
Mark
test_play_services
as xfail for FastRTPS and CycloneDDS (#1091)fixed typo (#1057)
Fix hangout in rosbag2 player and recorder when pressing
CTRL+C
(#1081)Added support for excluding topics via regular expressions (#1046)
Use a single variable for evaluating the filter regex (#1053)
Add additional mode of publishing sim time updates triggered by replayed messages (#1050)
Speed optimization: Preparing copyless publish/subscribing by using const message for writing (#1010)
Renamed –topics-regex to –regex and -e in Player class to be consistent with Recorder (#1045)
Refactor play until and duration tests (#1024)
Added support for filtering topics via regular expressions on Playback (#1034)
Adds stop operation for rosbag2::Player (#1007)
Fix incorrect boundary check for
playback_duration
andplay_until_timestamp
(#1032)Split up the include of rclcpp.hpp (#1027)
Notification of significant events during bag recording and playback (#908)
Adds play until timestamp functionality (#1005)
Add CLI verb for burst mode of playback (#980)
Add on play message callbacks to the
rosbag2::Player
class (#1004)Add play-for specified number of seconds functionality (#960)
Reduce message spam when topics to be recorded do not exist (#1018)
Address flakiness in record_all_with_sim_time test (#1014)
Add debug instrumentation for
test_play_services
(#1013)Fix for rosbag2::Player freeze when pressing ctrl+c in pause mode (#1002)
Add the /bigobj flag to Windows Debug builds. (#1009)
Make unpublished topics unrecorded by default (#968)
Make peek_next_message_from_queue return a SharedPtr. (#993)
Change the topic names in test_record.cpp (#988)
Contributors: Agustin Alba Chicar, Bernardo Taveira, Brian, Chris Lalancette, Cristóbal Arroyo, Daisuke Nishimatsu, DensoADAS, Emerson Knapp, Esteve Fernandez, Geoffrey Biggs, Jorge Perez, Joshua Hampp, Michael Orlov, Misha Shalem, Sean Kelly, Tony Peng, james-rms, kylemarcey, mergify[bot], rshanor
rosgraph_msgs
rosidl_adapter
rosidl_adapter/cmake/rosidl_adapt_interfaces.cmake: Make ament free (#709)
[service introspection] generate service_event messages (#700)
Adding tests for unicode support in message comments. (#720)
[rolling] Update maintainers - 2022-11-07 (#717)
Add action2idl script (#654)
Contributors: Audrow Nash, Brian, Guilherme Henrique Galelli Christmann, John Daktylidis, Yasushi SHOJI
rosidl_cli
rosidl_cmake
Type Description Codegen and Typesupport (rep2011) (#727)
Type hash in interface codegen (rep2011) (#722)
[service introspection] generate service_event messages (#700)
[rolling] Update maintainers - 2022-11-07 (#717)
Skip rosidl_generate_interfaces dependency export on SKIP_INSTALL. (#708)
Move rosidl_cmake Python module to a new package rosidl_pycommon (#696) Deprecate the Python module in rosidl_cmake and move the implementation to the new package rosidl_pycommon.
Fix comment in camel case conversion function (#683)
Protect rosidl_target_interfaces from using NOTFOUND in include_directories (#679)
Contributors: Audrow Nash, Brian, Chris Lalancette, Emerson Knapp, Jacob Perron, Jose Luis Rivero, Shane Loretz
rosidl_core_generators
[rolling] Update maintainers - 2022-11-07 (#2)
Add generators and runtime configuration packages (#1) Moved (and renamed) from rosidl_defaults. Related PR: https://github.com/ros2/rosidl_defaults/pull/22
Contributors: Audrow Nash, Jacob Perron
rosidl_core_runtime
[rolling] Update maintainers - 2022-11-07 (#2)
Add generators and runtime configuration packages (#1) Moved (and renamed) from rosidl_defaults. Related PR: https://github.com/ros2/rosidl_defaults/pull/22
Contributors: Audrow Nash, Jacob Perron
rosidl_default_generators
add service_msgs depend (#24)
[rolling] Update maintainers - 2022-11-07 (#25)
Move dependencies to rosidl_core and depend on action_msgs (#22) Move implementation to new packages rosidl_core_generators and rosidl_runtime_generators The new packages are located in a separate repository: https://github.com/ros2/rosidl_core.git rosidl_defaults now depends on the new packages, plus message definitions required for Actions (namely action_msgs). This allows users to avoid having to explictly depend on action_msgs.
Contributors: Audrow Nash, Brian, Jacob Perron
rosidl_default_runtime
add service_msgs depend (#24)
[rolling] Update maintainers - 2022-11-07 (#25)
Move dependencies to rosidl_core and depend on action_msgs (#22) Move implementation to new packages rosidl_core_generators and rosidl_runtime_generators The new packages are located in a separate repository: https://github.com/ros2/rosidl_core.git rosidl_defaults now depends on the new packages, plus message definitions required for Actions (namely action_msgs). This allows users to avoid having to explictly depend on action_msgs.
Contributors: Audrow Nash, Brian, Jacob Perron
rosidl_dynamic_typesupport
rosidl_dynamic_typesupport_fastrtps
rosidl_generator_c
Type Description Codegen and Typesupport (rep2011) (#727)
Expose type hash on typesupports (rep2011) (#729)
Type hash in interface codegen (rep2011) (#722)
[service introspection] generate service_event messages (#700)
[rolling] Update maintainers - 2022-11-07 (#717)
Move rosidl_generator_c/cpp tests to a separate package (#701)
Move rosidl_cmake Python module to a new package rosidl_pycommon (#696) Deprecate the Python module in rosidl_cmake and move the implementation to the new package rosidl_pycommon.
Add namespaced ALIAS target to easily consume generated libraries via add_subdirectory (#605)
Contributors: Audrow Nash, Brian, Emerson Knapp, Jacob Perron, Silvio Traversaro
rosidl_generator_cpp
Type Description Codegen and Typesupport (rep2011) (#727)
Expose type hash on typesupports (rep2011) (#729)
Type hash in interface codegen (rep2011) (#722)
[service introspection] generate service_event messages (#700)
[rolling] Update maintainers - 2022-11-07 (#717)
Move rosidl_generator_c/cpp tests to a separate package (#701)
Move rosidl_cmake Python module to a new package rosidl_pycommon (#696) Deprecate the Python module in rosidl_cmake and move the implementation to the new package rosidl_pycommon.
Add namespaced ALIAS target to easily consume generated libraries via add_subdirectory (#605)
Contributors: Audrow Nash, Brian, Emerson Knapp, Jacob Perron, Silvio Traversaro
rosidl_generator_dds_idl
rosidl_generator_py
Hides the assertions that checks the data types of the message fields. (#194)
Service introspection (#178)
[rolling] Update maintainers - 2022-11-07 (#189)
Remove stray numpy import (#185)
- man_farmer:
Fix NaN values bound numpy windows version (#182)
Allow NaN values to pass floating point bounds check. (#167)
Replace rosidl_cmake imports with rosidl_pycommon (#177)
Change decode error mode to replace (#176)
Merge pull request #173 from ros2/quarkytale/fix_import_order
fix flake
sorting after conversion
Revert “Use modern cmake targets to avoid absolute paths to appear in binary archives (#160)” (#166)
Use modern cmake targets to avoid absolute paths to appear in binary archives (#160)
michel as author
adding maintainer
Contributors: Audrow Nash, Ben Wolsieffer, Brian, Cristóbal Arroyo, Dharini Dutia, Eloy Briceno, Ivan Santiago Paunovic, Jacob Perron, Tomoya Fujita, quarkytale, Øystein Sture
rosidl_generator_tests
Type Description Codegen and Typesupport (rep2011) (#727)
Type hash in interface codegen (rep2011) (#722)
[service introspection] generate service_event messages (#700) * add service event message
[rolling] Update maintainers - 2022-11-07 (#717)
Move rosidl_generator_c/cpp tests to a separate package (#701)
Contributors: Audrow Nash, Brian, Emerson Knapp, Jacob Perron
rosidl_generator_type_description
rosidl_parser
rosidl_pycommon
Type Description Codegen and Typesupport (rep2011) (#727)
Type hash in interface codegen (rep2011) (#722)
[rolling] Update maintainers - 2022-11-07 (#717)
Move rosidl_cmake Python module to a new package rosidl_pycommon (#696) Deprecate the Python module in rosidl_cmake and move the implementation to the new package rosidl_pycommon.
Contributors: Audrow Nash, Emerson Knapp, Jacob Perron
rosidl_runtime_c
Dynamic Subscription (BONUS: Allocators): rosidl (#737)
Runtime Interface Reflection: rosidl (#728)
Type Description Codegen and Typesupport (rep2011) (#727)
Copied type_description_interfaces structs (rep2011) (#732)
Expose type hash on typesupports (rep2011) (#729)
Type hash in interface codegen (rep2011) (#722)
[service introspection] generate service_event messages (#700)
[rolling] Update maintainers - 2022-11-07 (#717)
Contributors: Audrow Nash, Brian, Emerson Knapp, methylDragon
rosidl_runtime_cpp
Type Description Codegen and Typesupport (rep2011) (#727)
Copied type_description_interfaces structs (rep2011) (#732)
Fix a few more clang analysis problems. (#731)
Return reference from BoundedVector::emplace_back (#730)
[service introspection] generate service_event messages (#700)
[rolling] Update maintainers - 2022-11-07 (#717)
fix conversion to ‘std::streamsize’ {aka ‘long int’} from ‘size_t’ {aka ‘long unsigned int’} may change the sign of the result (#715)
Contributors: Alexander Hans, Audrow Nash, Brian, Chris Lalancette, Emerson Knapp, ralwing
rosidl_runtime_py
Replace the use __slots__ for the appropiate API (#23)
fix(typing):
get_interface_packages
returns a dict (#22)[rolling] Update maintainers - 2022-11-07 (#21)
Expand timestamps for std_msgs.msg.Header and builtin_interfaces.msg.Time if ‘auto’ and ‘now’ are passed as values (#19)
Document a missing parameter in message_to_yaml. (#18)
Mirror rolling to master
Contributors: Audrow Nash, Chris Lalancette, Eloy Briceno, Esteve Fernandez, 兰陈昕
rosidl_typesupport_c
Type Description Nested Support (#141)
Fix rosidl_typesupport_c/cpp exec dependencies. (#140)
Type hashes in typesupport (rep2011) (#135)
Mark benchmark _ as UNUSED. (#134)
Service introspection (#127)
Update rosidl_typesupport to C++17. (#131)
[rolling] Update maintainers - 2022-11-07 (#130)
Replace rosidl_cmake imports with rosidl_pycommon (#126)
[service introspection] Use stddef.h instead of cstddef (#125)
Contributors: Audrow Nash, Brian, Chris Lalancette, Emerson Knapp, Jacob Perron
rosidl_typesupport_cpp
Type Description Nested Support (#141)
Fix rosidl_typesupport_c/cpp exec dependencies. (#140)
Type hashes in typesupport (rep2011) (#135)
Mark benchmark _ as UNUSED. (#134)
Service introspection (#127)
Update rosidl_typesupport to C++17. (#131)
[rolling] Update maintainers - 2022-11-07 (#130)
Replace rosidl_cmake imports with rosidl_pycommon (#126)
Contributors: Audrow Nash, Brian, Chris Lalancette, Emerson Knapp, Jacob Perron
rosidl_typesupport_fastrtps_c
Type Description Nested Support (#101)
Type hashes on typesupport (rep2011) (#98)
Expose type hash to typesupport structs (rep2011) (#95)
Mark benchmark _ as UNUSED. (#96)
Service introspection (#92)
Update rosidl_typesupport_fastrtps to C++17. (#94)
[rolling] Update maintainers - 2022-11-07 (#93)
Replace rosidl_cmake imports with rosidl_pycommon (#91)
Contributors: Audrow Nash, Brian, Chris Lalancette, Emerson Knapp, Jacob Perron
rosidl_typesupport_fastrtps_cpp
Type Description Nested Support (#101)
Type hashes on typesupport (rep2011) (#98)
Depend on ament_cmake_ros to default SHARED to ON (#99)
Expose type hash to typesupport structs (rep2011) (#95)
Mark benchmark _ as UNUSED. (#96)
Service introspection (#92)
Update rosidl_typesupport_fastrtps to C++17. (#94)
[rolling] Update maintainers - 2022-11-07 (#93)
Replace rosidl_cmake imports with rosidl_pycommon (#91)
Contributors: Audrow Nash, Brian, Chris Lalancette, Emerson Knapp, Jacob Perron, Tyler Weaver
rosidl_typesupport_interface
rosidl_typesupport_introspection_c
Type Description Codegen and Typesupport (rep2011) (#727)
Expose type hash on typesupports (rep2011) (#729)
Type hash in interface codegen (rep2011) (#722)
[service introspection] generate service_event messages (#700)
[rolling] Update maintainers - 2022-11-07 (#717)
Move rosidl_cmake Python module to a new package rosidl_pycommon (#696) Deprecate the Python module in rosidl_cmake and move the implementation to the new package rosidl_pycommon.
Fix build export dependencies in C introspection package (#695)
Add namespaced ALIAS target to easily consume generated libraries via add_subdirectory (#605)
Contributors: Audrow Nash, Brian, Emerson Knapp, Jacob Perron, Silvio Traversaro
rosidl_typesupport_introspection_cpp
Type Description Codegen and Typesupport (rep2011) (#727)
Expose type hash on typesupports (rep2011) (#729)
Type hash in interface codegen (rep2011) (#722)
Make sure to add the event message to typesupport introspection cpp. (#724)
[service introspection] generate service_event messages (#700)
[rolling] Update maintainers - 2022-11-07 (#717)
Move rosidl_cmake Python module to a new package rosidl_pycommon (#696) Deprecate the Python module in rosidl_cmake and move the implementation to the new package rosidl_pycommon.
Add namespaced ALIAS target to easily consume generated libraries via add_subdirectory (#605)
Contributors: Audrow Nash, Brian, Chris Lalancette, Emerson Knapp, Jacob Perron, Silvio Traversaro
rosidl_typesupport_introspection_tests
Fix a few more clang analysis problems. (#731) In particular, make sure to mark the fact that we are C++17 (as the emplace_back signature changed), and also add in a few more (void)_ for benchmark tests.
[service introspection] generate service_event messages (#700)
[rolling] Update maintainers - 2022-11-07 (#717)
Contributors: Audrow Nash, Brian, Chris Lalancette
rosidl_typesupport_tests
rpyutils
[rolling] Update maintainers - 2022-11-07 (#10)
Mirror rolling to master
updating maintainer
Contributors: Audrow Nash, Dharini Dutia
rqt
rqt_action
rqt_bag
Use default storage id (#140)
Use rosbag2_py API instead of direct bag parsing
[rolling] Update maintainers - 2022-11-07 (#132)
For get_entry_after, bump by 1 nanosecond otherwise always get the same message equal to the timestamp
Use rosbag2_py.reader for all message queries, remove sqlite3 direct usage
Cleanup for review
Improved logging
Use a rosbag2_py.Reader to get bag metadata
Disable reading from bag while recording - use direct caching to index for timeline
Increase publishing checkbox size (#122)
Fix toggle thumbnails button (#117)
ensure data types match what PyQt expects (#118)
Visualize topics being published and highlight topic being selected (#116)
Be able to scroll up and down, not only zoom-in and out the timeline (#114)
[Fixes] Fix crash when no qos metadata, make scroll bar appear if needed, add gitignore (#113)
Fix the types being passed into QFont and QColor. (#109)
fix long topic names (#114)
fix zoom behavior (#76)
Contributors: Audrow Nash, Chris Lalancette, Emerson Knapp, Ivan Santiago Paunovic, Kenji Brameld, Yadunund
rqt_bag_plugins
rqt_console
[rolling] Update maintainers - 2022-11-07 (#39)
added new maintainer
Contributors: Arne Hitzmann, Audrow Nash
rqt_graph
Refresh rosgraph when params checkbox is clicked (#87)
[rolling] Update maintainers - 2022-11-07 (#83)
Minor cleanup (#80)
Mirror rolling to galactic-devel
graph load/save into DOT file corrections for py3 (#78)
Remove repeated prefixes from buttons
Contributors: Audrow Nash, Chris Lalancette, David V. Lu!!, Yadunund, mergify[bot]
rqt_gui
rqt_gui_cpp
rqt_gui_py
rqt_msg
[rolling] Update maintainers - 2022-11-07 (#17)
Contributors: Audrow Nash
rqt_plot
rqt_publisher
Changes the use of __slots__ for the field and field type getter
[rolling] Update maintainers - 2022-11-07 (#36)
Minor cleanups in rqt_publisher for ROS 2 (#35)
Delete sync to foxy-devel workflow
Merge pull request #33 from NBadyal/improve-evaluation-of-types
Use regex matching to strip errors from input
Change slot_type verification strategy
Mirror rolling to foxy-devel
Contributors: Audrow Nash, Chris Lalancette, Geoffrey Biggs, Michael Jeronimo, Nicholas Badyal, Voldivh
rqt_py_common
rqt_py_console
[rolling] Update maintainers - 2022-11-07 (#13)
Contributors: Audrow Nash, Jacob Perron
rqt_reconfigure
reorder imports to fix flake8 warning (#129)
Fixed validator locale when float value is not bound in a range. (#121)
get parameter type from descriptor
[rolling] Update maintainers - 2022-11-07 (#122)
Cleanup mislabeled BSD license (#66)
Add support for array types (#108)
Fix float slider step size (#117)
update maintainer
Fixed package to run with ros2 run (#81)
fix updating range limits (#108)
Improvement; “GUI hangs for awhile or completely, when any one of nodes doesn’t return any value” (#81)
Contributors: Aris Synodinos, Audrow Nash, Christian Rauch, Dharini Dutia, Florian Vahl, Jacob Perron, Shrijit Singh, Tully Foote, quarkytale
rqt_service_caller
[rolling] Update maintainers - 2022-11-07 (#25)
Contributors: Audrow Nash, Jacob Perron
rqt_shell
[rolling] Update maintainers - 2022-11-07 (#17)
Contributors: Audrow Nash, Jacob Perron
rqt_srv
[rolling] Update maintainers - 2022-11-07 (#10)
Contributors: Audrow Nash, Jacob Perron
rqt_topic
rti_connext_dds_cmake_module
Use unified approach for checking the existence of environment variables (#117)
Contributors: Christopher Wecht
rttest
rviz2
rviz_assimp_vendor
rviz_common
Update Frame shortcut (#958) * Update Frame shortcut
Update rviz to C++17. (#939)
[rolling] Update maintainers - 2022-11-07 (#923)
Remove YAML_CPP_DLL define (#831)
Document getTransform() time behavior (#893)
Ogre 1.12.10 upgrade (#878)
Add RVIZ_COMMON_PUBLIC macro (#865)
Make sure not to dereference a null Renderable pointer. (#850)
Contributors: Akash, Audrow Nash, Chris Lalancette, David V. Lu!!, Kenji Brameld, Marcel Zeilinger, Shane Loretz, juchajam
rviz_default_plugins
Fix ODR errors with gmock (#967)
Update Frame shortcut (#958)
point_marker: fix bug where the number of rendered points accumulates over time (#949)
Update rviz to C++17. (#939)
Fix tolerance calculation precision (#934)
Fix MeshResourceMarker for mesh with color-based embedded material (#928)
[rolling] Update maintainers - 2022-11-07 (#923)
Add Map Display binary option (#846)
Delete frame_locked_markers when reusing marker (#907)
Consider region of interest in CameraDisplay (#864)
std::copy fix - OccupancyGridUpdate - Data is not being processed correctly (#895)
Set error status when duplicate markers are in the same MarkerArray (#891)
Make Axes display use latest transform (#892)
Show link names in inertia error message (#874)
Ogre 1.12.10 upgrade (#878)
Use make_shared to construct PointCloud2 (#869)
Fix include order (#858)
Contributors: AndreasR30, Audrow Nash, Chris Lalancette, David V. Lu!!, Eric, Hunter L. Allen, Jacob Perron, Kenji Brameld, Patrick Roncagliolo, Shane Loretz, Timon Engelke, Xavier BROQUERE, Xenofon Karamanos, methylDragon
rviz_ogre_vendor
Fix build failures on macOS + Apple Silicon (#944)
[rolling] Update maintainers - 2022-11-07 (#923)
Remove broken rviz_ogre_vendor::RenderSystem_GL target (#920)
Fixes policy CMP0135 warning for CMake >= 3.24 (#898)
Ogre 1.12.10 upgrade (#878)
Make resource file paths relative (#862)
Use CMAKE_STAGING_PREFIX for staging OGRE installation (#861)
Contributors: Audrow Nash, Cristóbal Arroyo, Kenji Brameld, Scott K Logan, Shane Loretz, Yadu
rviz_rendering
rviz_rendering_tests
rviz_visual_testing_framework
sensor_msgs
update YUV format codes and documentation (#214)
sensor_msgs/Range lacks variance field (#181)
Update common_interfaces to C++17. (#215)
[rolling] Update maintainers - 2022-11-07 (#210)
Replaced non-ASCII dash symbol with ASCII dash (#208)
Add NV21 and NV24 to colour formats (#205)
Update BatteryState.msg (#206)
use regex for matching cv types (#202)
Fix outdated file path for image_encodings (#200)
Use uint32_t for pointcloud2 resize method (#195)
Retain width and height after resize for master (#193)
Contributors: Audrow Nash, Borong Yuan, Chris Lalancette, Christian Rauch, El Jawad Alaa, Geoffrey Biggs, Ivan Zatevakhin, Kenji Brameld, Tianyu Li
sensor_msgs_py
service_msgs
shape_msgs
spdlog_vendor
Update to spdlog 1.9.2 (#33)
[rolling] Update maintainers - 2022-11-07 (#31)
Update to spdlog 1.9.1 (#27)
Fixes policy CMP0135 warning for CMake >= 3.24 (#30)
build shared lib only if BUILD_SHARED_LIBS is set (#29)
Mirror rolling to master
xml tag order
updating maintainer
Contributors: Audrow Nash, Chris Lalancette, Cristóbal Arroyo, Dharini Dutia, Scott K Logan, hannes09
sqlite3_vendor
sros2
statistics_msgs
std_msgs
std_srvs
stereo_msgs
tango_icons_vendor
[rolling] Update maintainers - 2022-11-07 (#10)
Mirror rolling to master
Contributors: Audrow Nash
test_cli
test_cli_remapping
test_communication
Update the system tests to C++17. (#510)
[rolling] Update maintainers - 2022-11-07 (#509)
Revert “Replace deprecated spin_until_future_complete with spin_until_complete (#499)” (#504)
Replace deprecated spin_until_future_complete with spin_until_complete (#499)
Contributors: Audrow Nash, Chris Lalancette, Hubert Liberacki, William Woodall
test_interface_files
[rolling] Update maintainers - 2022-11-07 (#21)
Mirror rolling to master
Contributors: Audrow Nash
test_launch_ros
Enable document generation using rosdoc2 (#359)
Fix normalize_parameters_dict for multiple nodes in the same namespace (#347)
Implement None check for ComposableNodeContainer (#341)
Add LifecyleTransition action (#317)
Ensure load_composable_nodes respects condition (#339)
[rolling] Update maintainers - 2022-11-07 (#331)
RosTimer -> ROSTimer and PushRosNamespace -> PushROSNamespace, to follow PEP8 (#326)
add SetROSLogDir action (#325)
Support default values in parameter substitution (#313)
Run condition for composable nodes (#311)
Load composable nodes in sequence (#315)
Contributors: Aditya Pande, Alexey Merzlyakov, Audrow Nash, Christoph Hellmann Santos, Kenji Miyake, Shane Loretz, William Woodall, Yadu, methylDragon
test_launch_testing
[rolling] Update maintainers - 2022-11-07 (#671)
Contributors: Audrow Nash
test_msgs
test_osrf_testing_tools_cpp
test_quality_of_service
Fix ODR errors with gtest (#514)
Avoid flaky test (#513)
Update the system tests to C++17. (#510)
[rolling] Update maintainers - 2022-11-07 (#509)
Pass rclcpp::QoS to create_service (#507)
Pass rclcpp::QoS to create_client (#506)
Remove Werror from test_quality_of_service. (#503)
Revert “Replace deprecated spin_until_future_complete with spin_until_complete (#499)” (#504)
Replace deprecated spin_until_future_complete with spin_until_complete (#499)
Add tests for ‘best available’ QoS policies (#501)
Contributors: Audrow Nash, Chen Lihui, Chris Lalancette, Hubert Liberacki, Jacob Perron, Shane Loretz, William Woodall, methylDragon
test_rclcpp
Update the system tests to C++17. (#510)
[rolling] Update maintainers - 2022-11-07 (#509)
Pass rclcpp::QoS to create_service (#507)
Pass rclcpp::QoS to create_client (#506)
Revert “Replace deprecated spin_until_future_complete with spin_until_complete (#499)” (#504)
Replace deprecated spin_until_future_complete with spin_until_complete (#499)
Contributors: Audrow Nash, Chris Lalancette, Hubert Liberacki, Shane Loretz, William Woodall
test_rmw_implementation
test_ros2trace
Move ros2trace tests to new test_ros2trace package (#63)
Contributors: Christophe Bedard
test_security
[rolling] Update maintainers - 2022-11-07 (#509)
Contributors: Audrow Nash
test_tf2
test_tracetools
Disable tracing on Android (#72)
Add intra-process tracepoints (#30)
Allow requiring minimum lttng package version for is_lttng_installed (#59)
Disable tracing on macOS (#53)
Include tracepoints by default on Linux (#31)
Fix memory leak in tracetools::get_symbol() (#43)
Update tracing to C++17. (#33)
Contributors: Chris Lalancette, Christophe Bedard, Przemysław Dąbrowski, ymski
test_tracetools_launch
Error out if trace already exists unless ‘append’ option is used (#58)
Make subbuffer size configurable with Trace action (#51)
Allow requiring minimum lttng package version for is_lttng_installed (#59)
Enable document generation using rosdoc2 for ament_python pkgs (#50)
Contributors: Christophe Bedard, Christopher Wecht, Yadu
tf2
Fix error code returned in BufferCore::walkToTopParent (#602)
Depend on ament_cmake_ros to default SHARED to ON (#591)
Fix a potential crash in TimeCache::findClosest (#592)
Extend TimeCache API to provide rich ExtrapolationException infos (#586)
Update geometry2 to C++17 (#584)
Include required header Scalar.h (#559)
Update maintainers (#560)
Contributors: Audrow Nash, Chris Lalancette, Patrick Roncagliolo, Shane Loretz, Tyler Weaver
tf2_bullet
tf2_eigen
tf2_eigen_kdl
tf2_geometry_msgs
tf2_kdl
tf2_msgs
tf2_py
tf2_ros
Destroy callback group before node (#595)
Enable TransformListener node-based constructor in Intra-process enabled components (#572)
Fix use-after-free bug in BufferServer::cancelCB (#579)
Update the demos to C++17. (#578)
add constructor to static tf broadcaster accepting node interfaces (#576)
Update maintainers (#560)
Switching from sstream to c string formatting to fix ros arg issue (#557)
allow construction of tf broadcaster from node object (not a pointer) (#555)
Allow to construct
TransformBroadcaster
andTransformListener
from node interfaces (#552)Suppress spam from calling canTransform (#529)
Contributors: Alberto Soragna, Alexander Hans, Audrow Nash, Chris Lalancette, Gonzo, Michael Carroll, Patrick Roncagliolo
tf2_ros_py
tf2_sensor_msgs
Update the demos to C++17. (#578)
Update maintainers (#560)
feat: export tf2 sensor msgs target (#536)
tf2_sensor_msgs find the right Python executable. (#525)
Add missing ament_cmake_pytest package needed because of newly-enabled test (#520)
Port point cloud transformation to numpy (#507)
Contributors: Audrow Nash, Chris Lalancette, Daisuke Nishimatsu, Florian Vahl, Jorge Perez, Michael Jeronimo
tf2_tools
tlsf
tlsf_cpp
topic_monitor
topic_statistics_demo
tracetools
Disable tracing on Android (#72)
Add intra-process tracepoints (#30)
Improve tracetools rosdoc2/doxygen output (#57)
Update README and other documentation (#55)
Disable tracing on macOS (#53)
Include tracepoints by default on Linux (#31)
Explicitly link against dl for dladdr() (#48)
Fix memory leak in tracetools::get_symbol() (#43)
Add TRACEPOINT_ENABLED() and DO_TRACEPOINT() macros (#46)
Update tracing to C++17. (#33)
Add new rclcpp_subscription_init tracepoint to support new intra-process comms
Contributors: Chris Lalancette, Christophe Bedard, Przemysław Dąbrowski, ymski
tracetools_launch
Error out if trace already exists unless ‘append’ option is used (#58)
Improve ‘ros2 trace’ command error handling & add end-to-end tests (#54)
Make subbuffer size configurable with Trace action (#51)
Enable document generation using rosdoc2 for ament_python pkgs (#50)
Remove deprecated context_names parameter (#38)
Contributors: Christophe Bedard, Christopher Wecht, Yadu
tracetools_trace
Error out if trace already exists unless ‘append’ option is used (#58)
Improve ‘ros2 trace’ command error handling & add end-to-end tests (#54)
Make subbuffer size configurable with Trace action (#51)
Add intra-process tracepoints (#30)
Allow requiring minimum lttng package version for is_lttng_installed (#59)
Include tracepoints by default on Linux (#31)
Enable document generation using rosdoc2 for ament_python pkgs (#50)
Replace distutils.version.StrictVersion with packaging.version.Version (#42)
Remove deprecated context_names parameter (#38)
Contributors: Christophe Bedard, Christopher Wecht, Yadu, ymski
trajectory_msgs
turtlesim
Remove the range constraints from the holonomic parameter. (#150) (#151)
Update turtlesim to C++17. (#146)
[rolling] Update maintainers - 2022-11-07 (#145)
Add parameter to enable holonomic motion (#131)
Add humble turtle (#140)
Contributors: Audrow Nash, Chris Lalancette, Daisuke Sato, mergify[bot]
type_description_interfaces
unique_identifier_msgs
urdf
urdf_parser_plugin
[rolling] Update maintainers - 2022-11-07 (#35)
Contributors: Audrow Nash