CHANGELOG

Changelog for package robot_state_publisher

3.5.3 (2025-10-17)

  • Add functionality to read description from a topic instead of a parameter (#234)

  • Removed tf2_ros warning (#239)

  • fix cmake deprecation (#232)

  • Removed tf2_ros warning (#238)

  • Removed orocos kdl vendor dependency (#237)

  • Removed warnings in geometry2 (#236)

  • Contributors: Alejandro Hernández Cordero, Kenji Brameld (TRACLabs), mosfet80

3.5.2 (2025-07-18)

  • Replace deprecated tf2_ros headers (#235)

  • Contributors: Alejandro Hernández Cordero

3.5.1 (2025-05-19)

  • Removed deprecated command-line argument (#233)

  • Contributors: Alejandro Hernández Cordero

3.5.0 (2025-04-25)

3.4.2 (2024-12-20)

  • Use emplace() with std::map`s (`#231)

  • Remove CODEOWNERS and mirror-rolling-to-main workflow (#229)

  • Contributors: Alejandro Hernández Cordero, Patrick Roncagliolo

3.4.1 (2024-08-28)

  • update urdf model header (#223)

  • Contributors: Alejandro Hernández Cordero

3.4.0 (2024-04-26)

3.3.3 (2024-01-24)

  • Fix reload after a description with a mimic joint (#212)

  • Contributors: Guillaume Doisy

3.3.2 (2023-11-06)

  • Remove ament_target_dependencies. (#209)

  • Contributors: Chris Lalancette

3.3.1 (2023-06-07)

  • Improve log messages (#206)

  • Contributors: Nick Lamprianidis

3.3.0 (2023-04-28)

3.2.0 (2023-04-11)

  • Update robot_state_publisher to C++17. (#204)

  • Contributors: Chris Lalancette

3.1.2 (2023-02-13)

  • [rolling] Update maintainers - 2022-11-07 (#203)

  • Contributors: Audrow Nash

3.1.1 (2022-09-13)

  • Mirror rolling to ros2

  • Contributors: Audrow Nash

3.1.0 (2022-05-10)

3.0.2 (2022-04-05)

  • Depend on orocos_kdl_vendor (#191)

  • Contributors: Jacob Perron

3.0.1 (2022-03-28)

  • export dependencies, to use robot_state_publisher as a component (#193)

  • Contributors: Kenji Brameld

3.0.0 (2022-01-14)

  • Fix include order for cpplint (#186)

  • Change how parameter updates are handled (#180)

  • Install includes to instal/${PROJECT_NAME} (#184)

  • Make the change_fixed_joint test more robust (#183)

  • Add in a test to make sure fixed transforms change on update

  • Small C++ nice-isms in the tests

  • Switch to using target_include_directories for tests

  • Publish new fixed transforms when URDF is updated

  • Make joint_states subscription QoS configurable; default to SensorDataQoS (#179)

  • Remove dependency on urdfdom_headers (#168)

  • Contributors: Anthony Deschamps, Chris Lalancette, Jacob Perron, Russell Joyce, Shane Loretz

2.7.0 (2021-10-18)

  • Fix deprecated subscriber callbacks (#173)

  • Contributors: Abrar Rahman Protyasha

2.6.0 (2021-08-02)

  • Cleanup the documentation in the RobotStatePublisher class. (#172)

  • Always publish fixed frames to /tf_static (#158)

  • corrected publish_frequency default in README (#166)

  • Contributors: Chris Lalancette, Jacob Perron, Nils Schulte

2.5.0 (2021-06-11)

  • Add tf frame_prefix parameter (#159)

  • Contributors: Steve Nogar, Chris Lalancette

2.4.3 (2021-04-19)

  • Stop rejecting unknown parameters. (#161)

  • Contributors: Chris Lalancette

2.4.2 (2021-01-25)

  • clean up license to be standard bsd 3 clause (#130)

  • Update the maintainers. (#151)

  • Contributors: Chris Lalancette, Tully Foote

2.4.1 (2020-09-28)

  • fix types in range loops to avoid copy due to different type (#143)

  • Make sure not to crash on an invalid URDF. (#141)

  • Contributors: Chris Lalancette, Dirk Thomas

2.4.0 (2020-04-30)

  • Replace deprecated launch_ros usage (#137)

  • code style only: wrap after open parenthesis if not in one line (#129)

  • Refactor the ROS 2 code to be more modern (#126)

  • Switch to using TARGET_FILE to find the binary targets on Windows.

  • Fix tests on Windows.

  • Make the error message much nicer on Windows.

  • robot_state_publisher_node -> robot_state_publisher

  • Fix test build on Windows.

  • Get rid of redundant declaration.

  • Guard against negative publish_frequencies.

  • Switch to modern launch_testing ReadyToTest.

  • Add testing to robot_state_publisher.

  • Update some example launch files.

  • Implement the ability to change the parameters on the fly.

  • Fix silly bug while computing the publish interval.

  • Refactor to have a “setup” function during the constructor and later on during the parameter setup.

  • Mark things as explicit and final.

  • Update the documentation.

  • Make robot_state_publisher composable.

  • Contributors: Chris Lalancette, Dirk Thomas, Jacob Perron

2.3.1 (2019-10-23)

  • Switch the license back to BSD. (#121)

  • Contributors: Chris Lalancette

2.3.0 (2019-09-26)

  • Install include directories (#31)

  • Publish URDF string on startup (#24)

  • Contributors: Patrick Beeson, Poh Zhi-Ee, Shane Loretz

2.2.4 (2019-09-06)

  • Remove unused Eigen3 dependency (#27) (#29)

  • Don’t export exe as library (#25) (ros2 #28)

  • Contributors: Shane Loretz

2.2.3 (2019-06-12)

  • Use rclcpp::Time for stamping transforms (#20)

  • Contributors: Scott K Logan

2.2.2 (2019-05-08)

  • changes to avoid deprecated API’s (#19)

  • Contributors: William Woodall

2.2.1 (2019-04-26)

  • Updated to avoid deprecated API. (#18)

  • Contributors: William Woodall

2.2.0 (2019-04-14)

  • Set urdf content as parameter. (#15)

  • Contributors: Karsten Knese

2.1.0 (2018-06-27)

  • The robot model is now published on the robot_description topic as a std_msgs/String.msg. (#9)

  • Contributors: Brett, Mikael Arguedas

1.13.4 (2017-01-05)

  • Use urdf::*ShredPtr instead of boost::shared_ptr (#60)

  • Error log for empty JointState.position was downgraded to a throttled warning (#64)

  • Contributors: Jochen Sprickerhof, Sébastien BARTHÉLÉMY

1.13.3 (2016-10-20)

  • Added a new parameter “ignore_timestamp” (#65)

  • Fixed joints are not published over tf_static by default (#56)

  • Fixed segfault on undefined robot_description (#61)

  • Fixed cmake eigen3 warning (#62)

  • Contributors: Davide Faconti, Ioan A Sucan, Johannes Meyer, Robert Haschke

1.13.2 (2016-06-10)

  • Add target_link_libraries for joint_state_listener library + install it (#54)

  • Contributors: Kartik Mohta

1.13.1 (2016-05-20)

  • Add back future dating for robot_state_publisher (#49) (#51)

  • Fix subclassing test (#48)

  • Support for subclassing (#45) * Add joint_state_listener as a library

  • Contributors: Jackie Kay

1.13.0 (2016-04-12)

  • fix bad rebase

  • Contributors: Jackie Kay, Paul Bovbel

1.12.1 (2016-02-22)

  • Merge pull request #42 from ros/fix_tests_jade Fix tests for Jade

  • Correct failing tests

  • Re-enabling rostests

  • Merge pull request #39 from scpeters/issue_38

  • Fix API break in publishFixedTransforms A bool argument was added to RobotStatePublisher::publishFixedTransforms which broke API. I’ve added a default value of false, to match the default specified in the JointStateListener constructor.

  • Contributors: Jackie Kay, Jonathan Bohren, Steven Peters

1.12.0 (2015-10-21)

  • Merge pull request #37 from clearpathrobotics/static-default Publish fixed joints over tf_static by default

  • Merge pull request #34 from ros/tf2-static-jade Port to tf2 and enable using static broadcaster

  • Merge pull request #32 from shadow-robot/fix_issue#19 Check URDF to distinguish fixed joints from floating joints. Floating joint are ignored by the publisher.

  • Merge pull request #26 from xqms/remove-debug get rid of argv[0] debug output on startup

  • Contributors: David Lu!!, Ioan A Sucan, Jackie Kay, Max Schwarz, Paul Bovbel, Toni Oliver

1.11.1 (2016-02-22)

  • Merge pull request #41 from ros/fix_tests_indigo Re-enable and clean up rostests

  • Correct failing tests

  • Re-enabling rostests

  • Fix API break in publishFixedTransforms A bool argument was added to RobotStatePublisher::publishFixedTransforms which broke API. I’ve added a default value of false, to match the default specified in the JointStateListener constructor.

  • Contributors: Jackie Kay, Jonathan Bohren, Steven Peters

1.11.0 (2015-10-21)

  • Merge pull request #28 from clearpathrobotics/tf2-static

1.10.4 (2014-11-30)

  • Merge pull request #21 from rcodddow/patch-1

  • Fix for joint transforms not being published anymore after a clock reset (e.g. when playing a bagfile and looping)

  • Contributors: Ioan A Sucan, Robert Codd-Downey, Timm Linder

1.10.3 (2014-07-24)

  • add version depend on orocos_kdl >= 1.3.0 Conflicts: package.xml

  • Update KDL SegmentMap interface to optionally use shared pointers The KDL Tree API optionally uses shared pointers on platforms where the STL containers don’t support incomplete types.

  • Contributors: Brian Jensen, William Woodall

1.10.0 (2014-03-03)

  • minor style fixes

  • Add support for mimic tag.

  • Contributors: Ioan Sucan, Konrad Banachowicz