CHANGELOG
Changelog for package fuse_publishers
1.3.1 (2025-08-29)
- Fix tf2_ros header order 
- Contributors: Stephen Williams 
1.3.0 (2025-07-28)
1.2.4 (2025-07-28)
1.2.3 (2025-05-24)
1.2.2 (2025-04-26)
- Added dependencies in required CMakeLists.txt and package.xml files 
- Added ament_cmake_ros and gtest_vendor dependencies 
- Removed duplicate package depends, alphabetized lists 
 - See https://www.linkedin.com/posts/open-source-robotics-foundation_were-looking-for-half-a-dozen-new-open-activity-7317690134764605440-jm3h/ Author: KB1110 <kartikbakshi10@gmail.com> 
- [RST-7809] Port fix for negative pi initial conditions from ROS1 to ROS2 (#335) * Add some unit tests for the 2D orientation constraints; Create getters/setters for the 2D orientation variable is preparation for a fix. * Force the 2D orientation value to be is minimum phase 
- Contributors: KB1110, Stephen Williams 
1.2.1 (2024-09-21)
1.2.0 (2024-05-02)
1.1.1 (2024-05-02)
1.1.0 (2024-04-20)
- Port support for Ceres 2.1.0 Manifold class into ROS 2 Rolling (#366) * Support gcc12 and ceres 2.1.0 * Add support for the Manifold class when using Ceres Solver version 2.1.0 and above * General clean up for Ceres 2.2.0 support * Updated serialization support to be backwards compatible with previously serialized files * Formatting changes required for ROS 2 Rolling / Ubuntu Noble 
- Contributors: Stephen Williams 
1.0.1 (2023-03-03)
1.0.0 (2023-03-03)
- Use upstream rclcpp::node_interfaces::NodeInterfaces (#313) * Use upstream rclcpp::node_interfaces::NodeInterfaces * Dereference node arguments to NodeInterfaces ——— Co-authored-by: methylDragon <methylDragon@gmail.com> 
- fuse -> ROS 2 fuse_models: Linting (#315) 
- Use getParameterName and namespace parameters for publishers (#314) 
- Fix SerializedPublisher not being able to read it’s parameters (#311) 
- Use rclcpp::Clock::wait_until_started (#303) 
- fuse -> ROS 2 : Doc Generation (#278) * Port doc generation and fix package.xml for linting * Fix small bugs in package.xml * Use default rosdoc2 settings * Use default rosdoc2 settings * Update fuse_doc for rosdoc2 ——— Co-authored-by: Shane Loretz <sloretz@google.com> 
- fuse -> ROS 2 fuse_optimizers: Port fuse_optimizers (#307) Co-authored-by: Shane Loretz <sloretz@osrfoundation.org> Co-authored-by: Shane Loretz <shane.loretz@gmail.com> 
- fuse -> ROS 2 fuse_publishers : Linting (#305) 
- fuse -> ROS 2 fuse_publishers: Port fuse_publishers (#299) Co-authored-by: Shane Loretz <shane.loretz@gmail.com> 
- fuse -> ROS 2 fuse_constraints : Linting (#298) 
- fuse -> ROS 2 fuse_graphs: Linting (#297) 
- fuse -> ROS 2 fuse_variables: Linting (#296) * Migrate to .hpp files * Create redirection headers * Make xmllint and uncrustify happy * Wrap most comment lines * Satisfy cpplint 
- fuse -> ROS 2 fuse_core: Linting (#292) 
- fuse -> ROS 2 fuse_core : Parameters and Tests (#286) Co-authored-by: Shane Loretz <sloretz@osrfoundation.org> Co-authored-by: Ivor Wanders <ivor@iwanders.net> 
- fuse -> ROS 2 : Port Time (#283) 
- fuse -> ROS 2 : Port Logging (#279) Co-authored-by: Tom Moore <tmoore@locusrobotics.com> 
- fuse -> ROS 2: Clean up macro usage warnings (#280) 
- fuse -> ROS 2 fuse_msgs : Port package and ignore unported packages for now (#277) Co-authored-by: Tom Moore <tmoore@locusrobotics.com> 
- [RST-4186] Fix fuse macro names (#263) * Namespace all macros with the FUSE_ prefix. Mark original macros as deprecated. * Update all fuse objects to use the new macro names 
- Adding doxygen to all packages (#241) 
- Contributors: Shane Loretz, Stephen Williams, Tom Moore, methylDragon 
0.4.2 (2021-07-20)
- Adding roslint dependency to fuse_viz (#231) * Adding roslint dependency to fuse_viz * Silence CMP0048 warnings 
- Contributors: Tom Moore 
0.4.1 (2021-07-13)
- Fixing license 
- Support throttling serialized graph publisher (#204) * Change sensor proc from gtest to gmock target * Move ThrottledCallback to fuse_core * Support generic callbacks in ThrottledCallback * Throttle graph publishing * Overload getPositiveParam for ros::Duration * Use getPositiveParam for ros::Duration parameters 
- Set latch param in serialized publisher to false by default (#184) 
- Add latch param to serialized publisher (#165) 
- Use transaction stamp in SerializedPublisher (#147) By using the transaction stamp instead of ros::Time::now() it’s possible to replay things with the same transaction and compare the original and new generated graphs. 
- Removed the explicit ‘-std=c++14’ compile flag (#119) * Removed the explicit ‘-std=c++14’ compile flag * Changed the CXX_STANDARD setting to be per-target instead of global * Added the CXX_STANDARD_REQUIRED setting to all targets 
- fix compilation in Kinetic (#112) 
- [RST-2149] Added the configured device_id to the log message (#110) 
- [RST-2427] Added a ‘source’ field to the constraints. This is an API-breaking change. (#101) 
- [RST-2340] Add serialization support to fuse (#98) 
- [RST-2148] Added start() and stop() methods to the MotionModel, SensorModel, and Publisher API (#75) * Added start() and stop() methods to the MotionModel, SensorModel, and Publisher API * Added the ability to clear the callback queue of the optimizer * Refactor the fixed-lag reset callback to use the plugins’ stop() and start() methods 
- Fix -Wall -Wextra warnings (#77) 
- Contributors: Davide Faconti, Enrique Fernandez Perdomo, Stephen Williams, Tom Moore 
0.4.0 (2019-07-12)
0.3.0 (2019-03-18)
0.2.0 (2019-01-16)
0.1.1 (2018-08-15)
0.1.0 (2018-08-12)
- [RST-1121] Moved the pose publishers (#19) * Moved the publisher base classes to the public repo * Moved the pose publisher implementations to the public repo * Added the option to publish the robot trajectory as a PoseArray message * Clean up Eigen depends and includes 
- Contributors: Stephen Williams