41 #include <moveit_msgs/MoveItErrorCodes.h>
42 #include <boost/function.hpp>
46 struct ExecutableMotionPlan;
49 struct ExecutableTrajectory
55 ExecutableTrajectory(
const robot_trajectory::RobotTrajectoryPtr& trajectory,
const std::string& description,
56 std::vector<std::string> controller_names = {})
73 struct ExecutableMotionPlan