Skip to content

Commit d5a46ae

Browse files
author
Guillaume Doisy
committed
EPSILON 1e-5
Signed-off-by: Guillaume Doisy <[email protected]>
1 parent 6bb35b8 commit d5a46ae

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

nav2_costmap_2d/plugins/static_layer.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -47,7 +47,7 @@
4747
#include "tf2_geometry_msgs/tf2_geometry_msgs.hpp"
4848
#include "nav2_ros_common/validate_messages.hpp"
4949

50-
#define EPSILON 1e-3
50+
#define EPSILON 1e-5
5151

5252
PLUGINLIB_EXPORT_CLASS(nav2_costmap_2d::StaticLayer, nav2_costmap_2d::Layer)
5353

0 commit comments

Comments
 (0)