Skip to content

Commit

Permalink
Fix tf2_eigen deprecated header warning
Browse files Browse the repository at this point in the history
  • Loading branch information
FelipeGdM committed Nov 20, 2023
1 parent 35aba81 commit 91090fe
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion pcl_recorder/include/PclRecorderROS2.h
Original file line number Diff line number Diff line change
Expand Up @@ -10,7 +10,7 @@
#include <pcl_conversions/pcl_conversions.h>
#include <tf2_ros/buffer.h>
#include <tf2_ros/transform_listener.h>
#include <tf2_eigen/tf2_eigen.h>
#include <tf2_eigen/tf2_eigen.hpp>
#include <rclcpp/time_source.hpp>

class PclRecorderROS2 : public rclcpp::Node
Expand Down

0 comments on commit 91090fe

Please sign in to comment.