Skip to content
Prev Previous commit
Next Next commit
Remove some extra headers
  • Loading branch information
shivaang12 committed May 14, 2020
commit 0e2ff34c818e2c15ca2971f0d411d5d661f086c2
Original file line number Diff line number Diff line change
Expand Up @@ -27,10 +27,6 @@
#include "geometry_msgs/msg/pose2_d.hpp"
#include "nav2_costmap_2d/costmap_2d.hpp"
#include "nav2_util/robot_utils.hpp"
#pragma GCC diagnostic push
#pragma GCC diagnostic ignored "-Wpedantic"
#include "tf2/utils.h"
#pragma GCC diagnostic pop

namespace nav2_costmap_2d
{
Expand Down