From c6e0e3d36b43693cd898dc67aede16f374efc68d Mon Sep 17 00:00:00 2001 From: Nisarg Panchal <71684502+Nisarg236@users.noreply.github.com> Date: Sat, 7 Dec 2024 11:07:41 +0530 Subject: [PATCH] Update obstacle_layer.h --- costmap_2d/include/costmap_2d/obstacle_layer.h | 1 - 1 file changed, 1 deletion(-) diff --git a/costmap_2d/include/costmap_2d/obstacle_layer.h b/costmap_2d/include/costmap_2d/obstacle_layer.h index d962e93f3..1ec7de9cd 100644 --- a/costmap_2d/include/costmap_2d/obstacle_layer.h +++ b/costmap_2d/include/costmap_2d/obstacle_layer.h @@ -198,7 +198,6 @@ class ObstacleLayer : public CostmapLayer bool reduced_footprint_enabled_; double footprint_reduction_size_; geometry_msgs::Point footprint_center_; - std::vector reduced_footprint_; void updateFootprint(double robot_x, double robot_y, double robot_yaw, double* min_x, double* min_y, double* max_x, double* max_y);