Skip to content

Commit b0a3fe5

Browse files
committed
fix build
1 parent 59c7950 commit b0a3fe5

File tree

1 file changed

+3
-0
lines changed

1 file changed

+3
-0
lines changed

nav2_costmap_2d/include/nav2_costmap_2d/layer.hpp

Lines changed: 3 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -184,6 +184,9 @@ class Layer
184184

185185
// Names of the parameters declared on the ROS node
186186
std::unordered_set<std::string> local_params_;
187+
188+
private:
189+
std::vector<geometry_msgs::msg::Point> footprint_spec_;
187190
};
188191

189192
} // namespace nav2_costmap_2d

0 commit comments

Comments
 (0)