Skip to content

Commit 178d769

Browse files
authored
Merge pull request #415 from PickNikRobotics/pr-fix-example-behavior-deps
Fix example_behavior dependencies
2 parents caf3629 + d5b6c20 commit 178d769

File tree

2 files changed

+2
-1
lines changed

2 files changed

+2
-1
lines changed

src/example_behaviors/include/example_behaviors/example_convert_mtc_solution_to_joint_trajectory.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -2,11 +2,11 @@
22

33
#include <behaviortree_cpp/action_node.h>
44
#include <behaviortree_cpp/bt_factory.h>
5-
#include <moveit/robot_model_loader/robot_model_loader.h>
65
#include <spdlog/spdlog.h>
76
#include <yaml-cpp/yaml.h>
87
#include <Eigen/Core>
98
#include <cartesian_planning/trajectory_utils.hpp>
9+
#include <moveit/robot_model_loader/robot_model_loader.hpp>
1010
#include <moveit_msgs/msg/robot_trajectory.hpp>
1111
#include <moveit_studio_behavior_interface/behavior_context.hpp>
1212
#include <moveit_studio_behavior_interface/check_for_error.hpp>

src/example_behaviors/src/example_sam2_segmentation.cpp

Lines changed: 1 addition & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -1,3 +1,4 @@
1+
#include <fmt/format.h>
12
#include <future>
23
#include <memory>
34
#include <string>

0 commit comments

Comments
 (0)