Skip to content
This commit does not belong to any branch on this repository, and may belong to a fork outside of the repository.

Commit f79161e

Browse files
committedJan 8, 2025·
fix import
Signed-off-by: Tony Najjar <tony.najjar.1997@gmail.com>
1 parent c1ad9fe commit f79161e

File tree

1 file changed

+2
-1
lines changed

1 file changed

+2
-1
lines changed
 

‎nav2_behavior_tree/include/nav2_behavior_tree/bt_utils.hpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -23,8 +23,9 @@
2323
#include "rclcpp/node.hpp"
2424
#include "behaviortree_cpp/behavior_tree.h"
2525
#include "geometry_msgs/msg/point.hpp"
26-
#include "geometry_msgs/msg/quaternion.hpp"
26+
#include "geometry_msgs/msg/pose_stamped.hpp"
2727
#include "geometry_msgs/msg/pose_stamped_array.hpp"
28+
#include "geometry_msgs/msg/quaternion.hpp"
2829
#include "nav_msgs/msg/path.hpp"
2930

3031
namespace BT

0 commit comments

Comments
 (0)
Please sign in to comment.