Skip to content

Commit

Permalink
Adding nan twist rejection for velocity smoother and collision monitor (
Browse files Browse the repository at this point in the history
ros-navigation#3658)

* adding nan twist rejection for velocity smoother and collision monitor

* deref
  • Loading branch information
SteveMacenski authored and Marc-Morcos committed Jul 4, 2024
1 parent f85e40e commit e0b73cf
Showing 1 changed file with 1 addition and 0 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -28,6 +28,7 @@
#include "tf2_ros/transform_listener.h"

#include "nav2_util/lifecycle_node.hpp"
#include "nav2_util/robot_utils.hpp"
#include "nav2_msgs/msg/collision_monitor_state.hpp"

#include "nav2_collision_monitor/types.hpp"
Expand Down

0 comments on commit e0b73cf

Please sign in to comment.