Skip to content

Commit fb4eac3

Browse files
authored
chore: tf2_ros to hpp headers (backport #1866) (#1869)
1 parent c836447 commit fb4eac3

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

admittance_controller/test/test_admittance_controller.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -38,7 +38,7 @@
3838
#include "rclcpp_lifecycle/node_interfaces/lifecycle_node_interface.hpp"
3939
#include "semantic_components/force_torque_sensor.hpp"
4040
#include "test_asset_6d_robot_description.hpp"
41-
#include "tf2_ros/transform_broadcaster.h"
41+
#include "tf2_ros/transform_broadcaster.hpp"
4242

4343
// TODO(anyone): replace the state and command message types
4444
using ControllerCommandWrenchMsg = geometry_msgs::msg::WrenchStamped;

0 commit comments

Comments
 (0)