We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent 090ddc7 commit 2edfb83Copy full SHA for 2edfb83
nav2_costmap_2d/plugins/static_layer.cpp
@@ -139,6 +139,7 @@ StaticLayer::getParameters()
139
140
// Enforce bounds
141
lethal_threshold_ = std::max(std::min(temp_lethal_threshold, 100), 0);
142
+ map_received_ = false;
143
}
144
145
void
@@ -241,6 +242,9 @@ StaticLayer::incomingMap(const nav_msgs::msg::OccupancyGrid::SharedPtr new_map)
241
242
{
243
std::lock_guard<Costmap2D::mutex_t> guard(*getMutex());
244
processMap(*new_map);
245
+ if (!map_received_) {
246
+ map_received_ = true;
247
+ }
248
249
250
0 commit comments