File tree Expand file tree Collapse file tree 4 files changed +2
-5
lines changed
include/moveit_task_constructor_demo Expand file tree Collapse file tree 4 files changed +2
-5
lines changed Original file line number Diff line number Diff line change 5757#include < moveit/task_constructor/solvers/cartesian_path.h>
5858#include < moveit/task_constructor/solvers/pipeline_planner.h>
5959#include < moveit_task_constructor_msgs/action/execute_task_solution.hpp>
60- #include " pick_place_demo_parameters.hpp"
60+ #include < moveit_task_constructor_demo/ pick_place_demo_parameters.hpp>
6161
6262#pragma once
6363
Original file line number Diff line number Diff line change 88#include < moveit/task_constructor/stages/compute_ik.h>
99
1010#include < moveit/task_constructor/cost_terms.h>
11- #include " ik_clearance_cost_parameters.hpp"
11+ #include < moveit_task_constructor_demo/ ik_clearance_cost_parameters.hpp>
1212
1313using namespace moveit ::task_constructor;
1414
Original file line number Diff line number Diff line change 4040// MTC pick/place demo implementation
4141#include < moveit_task_constructor_demo/pick_place_task.h>
4242
43- #include " pick_place_demo_parameters.hpp"
44-
4543static const rclcpp::Logger LOGGER = rclcpp::get_logger(" moveit_task_constructor_demo" );
4644
4745int main (int argc, char ** argv) {
Original file line number Diff line number Diff line change 3838#include < moveit_task_constructor_demo/pick_place_task.h>
3939#include < geometry_msgs/msg/pose.hpp>
4040#include < tf2_eigen/tf2_eigen.hpp>
41- #include " pick_place_demo_parameters.hpp"
4241
4342static const rclcpp::Logger LOGGER = rclcpp::get_logger(" moveit_task_constructor_demo" );
4443
You can’t perform that action at this time.
0 commit comments