Skip to content

Commit 288767f

Browse files
authored
Deprecating tf2 C Headers (#98)
Signed-off-by: CursedRock17 <[email protected]>
1 parent 19dd4c3 commit 288767f

File tree

2 files changed

+2
-2
lines changed

2 files changed

+2
-2
lines changed

include/laser_geometry/laser_geometry.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -39,7 +39,7 @@
3939

4040
#include <Eigen/Core> // NOLINT (cpplint cannot handle include order here)
4141

42-
#include "tf2/buffer_core.h"
42+
#include "tf2/buffer_core.hpp"
4343
#include "sensor_msgs/msg/laser_scan.hpp"
4444
#include "sensor_msgs/msg/point_cloud2.hpp"
4545
#include "laser_geometry/visibility_control.hpp"

src/laser_geometry.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -39,7 +39,7 @@
3939
#include "sensor_msgs/msg/laser_scan.hpp"
4040
#include "sensor_msgs/msg/point_cloud2.hpp"
4141

42-
#include "tf2/LinearMath/Transform.h"
42+
#include "tf2/LinearMath/Transform.hpp"
4343

4444
namespace laser_geometry
4545
{

0 commit comments

Comments
 (0)