File tree Expand file tree Collapse file tree 2 files changed +0
-12
lines changed
nav2_amcl/include/nav2_amcl
nav2_costmap_2d/include/nav2_costmap_2d Expand file tree Collapse file tree 2 files changed +0
-12
lines changed Original file line number Diff line number Diff line change 2828#include < utility>
2929#include < vector>
3030
31- // For compatibility with Jazzy
32- #include " rclcpp/version.h"
33- #if RCLCPP_VERSION_GTE(29, 0, 0)
3431#include " message_filters/subscriber.hpp"
35- #else
36- #include " message_filters/subscriber.h"
37- #endif
3832
3933#include " geometry_msgs/msg/pose_stamped.hpp"
4034#include " nav2_util/lifecycle_node.hpp"
Original file line number Diff line number Diff line change 4949#include " tf2_ros/message_filter.h"
5050#pragma GCC diagnostic pop
5151
52- // For compatibility with Jazzy
53- #include " rclcpp/version.h"
54- #if RCLCPP_VERSION_GTE(29, 0, 0)
5552#include " message_filters/subscriber.hpp"
56- #else
57- #include " message_filters/subscriber.h"
58- #endif
5953
6054#include " nav_msgs/msg/occupancy_grid.hpp"
6155#include " sensor_msgs/msg/laser_scan.hpp"
You can’t perform that action at this time.
0 commit comments