Skip to content

Commit cac6f6a

Browse files
Fix deprecated TF headers (#444)
1 parent 4ea96f9 commit cac6f6a

File tree

1 file changed

+2
-2
lines changed

1 file changed

+2
-2
lines changed

control_toolbox/include/control_filters/gravity_compensation.hpp

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -22,8 +22,8 @@
2222

2323
#include "filters/filter_base.hpp"
2424
#include "geometry_msgs/msg/vector3_stamped.hpp"
25-
#include "tf2_ros/buffer.h"
26-
#include "tf2_ros/transform_listener.h"
25+
#include "tf2_ros/buffer.hpp"
26+
#include "tf2_ros/transform_listener.hpp"
2727

2828
#include "control_toolbox/gravity_compensation_filter_parameters.hpp"
2929

0 commit comments

Comments
 (0)