Skip to content

Commit

Permalink
[nav2_behavior_tree] * Add missing headers on `decorator/path_longer_…
Browse files Browse the repository at this point in the history
…on_aproach.hpp`. (#2954)

Co-authored-by: Sebastian Almagro <[email protected]>
  • Loading branch information
salmagro and Sebastian Almagro authored May 19, 2022
1 parent 432b76d commit cfd9cec
Showing 1 changed file with 2 additions and 0 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -20,7 +20,9 @@
#include <limits>

#include "geometry_msgs/msg/pose_stamped.hpp"
#include "nav_msgs/msg/path.hpp"
#include "behaviortree_cpp_v3/decorator_node.h"
#include "rclcpp/rclcpp.hpp"

namespace nav2_behavior_tree
{
Expand Down

0 comments on commit cfd9cec

Please sign in to comment.