Description
Hello MoveIt Task Constructor developers,
I am currently working on a pick and place project using MTC. The idea is first to detect (-> localised) the object in the gazebo simulation, send the coordinates, which then will be used as a target position of the workpiece. I included two buttons in my project, 1st - is to spawn the workpieces (simple cylinders), and the 2nd is to start the MTC search. Everything works well, it finds 5 possible trajectories, but when it should execute the trajectory, the program fails, and throws an error: "Segmentation fault (Address not mapped to object [0xe8])", which I assume is my spawned workpiece. What is more, it was working a few weeks ago, with spawning and moving the workpiece, but I had to update plugins, and as I remember, that's the last moment when it was doing what I asked for. Interestingly, using the standard "Plan & Execute" functionality from the Motion Planning for the same robot and target pose (without MTC) works as expected, even with the spawned objects present in the scene.
Some details:
- ROS 2 Distro: Jazzy
- Ubuntu WSL Distro: Ubuntu 24.04 (Noble Numbat)
- MoveIt 2 (build binary) version: 2.12.13
- MTC: the newest in the main branch
- Gazebo version: v8.9.0 - Harmonic
I have run through the entire internet, but I couldn't find the solution to my problem, so thank you in advance!
The command line error:
user:~/ros2_ws$ ros2 launch mycobot_mtc run.launch.py
[INFO] [launch]: All log files can be found below /home/user/.ros/log/2025-06-02-11-09-02-412410-DESKTOP-0CDUC1V-55401
[INFO] [launch]: Default logging verbosity is set to INFO
[INFO] [static_transform_publisher-1]: process started with pid [55410]
[INFO] [robot_state_publisher-2]: process started with pid [55411]
[INFO] [static_transform_publisher-3]: process started with pid [55412]
[INFO] [mtc_node-4]: process started with pid [55413]
[INFO] [img_pubsub-5]: process started with pid [55414]
[INFO] [gazebo-6]: process started with pid [55415]
[INFO] [create-7]: process started with pid [55416]
[INFO] [parameter_bridge-8]: process started with pid [55419]
[INFO] [move_group-9]: process started with pid [55420]
[INFO] [spawner-10]: process started with pid [55421]
[static_transform_publisher-3] [INFO] [1748855344.488727316] [static_tf_pub_camera_model]: Spinning until stopped - publishing transform
[mtc_node-4] [WARN] [1748855344.617600155] [rcl.logging_rosout]: Publisher already registered for node name: 'mtc_node'. If this is due to multiple nodes with the same name then all logs for the logger named 'mtc_node' will go out over the existing publisher. As soon as any node with that name is destructed it will unregister the publisher, preventing any further logs for that name from being published on the rosout topic.
[mtc_node-4] [INFO] [1748855344.696608495] [mycobot_mtc]: MTCTaskNode initialized. Waiting for button presses and camera data...
[mtc_node-4] [INFO] [1748855344.696839794] [mycobot_mtc]: MTC node is spinning and waiting for button presses...
[move_group-9] [INFO] [1748855344.721250945] [move_group.moveit.moveit.ros.rdf_loader]: Loaded robot model in 0 seconds
[move_group-9] [INFO] [1748855344.721373345] [move_group.moveit.moveit.core.robot_model]: Loading robot model 'ur'...
[move_group-9] [INFO] [1748855344.721395544] [move_group.moveit.moveit.core.robot_model]: No root/virtual joint specified in SRDF. Assuming fixed joint
[move_group-9] [INFO] [1748855344.847537589] [move_group.moveit.moveit.kinematics.kdl_kinematics_plugin]: Joint weights for group 'arm_controller': 1 1 1 1 1 1
[move_group-9] [INFO] [1748855345.311221976] [move_group.moveit.moveit.ros.planning_scene_monitor]: Publishing maintained planning scene on 'monitored_planning_scene'
[move_group-9] [INFO] [1748855345.311518177] [move_group.moveit.moveit.ros.moveit_cpp]: Listening to 'joint_states' for joint states
[move_group-9] [INFO] [1748855345.312535481] [move_group.moveit.moveit.ros.current_state_monitor]: Listening to joint states on topic 'joint_states'
[move_group-9] [INFO] [1748855345.313625186] [move_group.moveit.moveit.ros.planning_scene_monitor]: Listening to '/attached_collision_object' for attached collision objects
[move_group-9] [INFO] [1748855345.313686286] [move_group.moveit.moveit.ros.planning_scene_monitor]: Stopping existing planning scene publisher.
[move_group-9] [INFO] [1748855345.314246189] [move_group.moveit.moveit.ros.planning_scene_monitor]: Stopped publishing maintained planning scene.
[move_group-9] [INFO] [1748855345.316651299] [move_group.moveit.moveit.ros.planning_scene_monitor]: Publishing maintained planning scene on 'monitored_planning_scene'
[move_group-9] [INFO] [1748855345.316842000] [move_group.moveit.moveit.ros.planning_scene_monitor]: Starting planning scene monitor
[move_group-9] [INFO] [1748855345.318351806] [move_group.moveit.moveit.ros.planning_scene_monitor]: Listening to '/planning_scene'
[move_group-9] [INFO] [1748855345.318417407] [move_group.moveit.moveit.ros.planning_scene_monitor]: Starting world geometry update monitor for collision objects, attached objects, octomap updates.
[move_group-9] [INFO] [1748855345.319166210] [move_group.moveit.moveit.ros.planning_scene_monitor]: Listening to 'collision_object'
[move_group-9] [INFO] [1748855345.322298223] [move_group.moveit.moveit.ros.planning_scene_monitor]: Listening to 'planning_scene_world' for planning scene world geometry
[move_group-9] [WARN] [1748855345.324473133] [move_group.moveit.moveit.ros.occupancy_map_monitor]: Resolution not specified for Octomap. Assuming resolution = 0.1 instead
[spawner-10] [INFO] [1748855345.443412846] [spawner_joint_state_broadcaster]: waiting for service /controller_manager/list_controllers to become available...
[move_group-9] [INFO] [1748855345.798222778] [move_group]: Loaded adapter 'default_planning_request_adapters/ValidateWorkspaceBounds'
[move_group-9] [INFO] [1748855345.798305078] [move_group]: Try loading adapter 'default_planning_request_adapters/CheckStartStateBounds'
[move_group-9] [INFO] [1748855345.798370778] [move_group]: Loaded adapter 'default_planning_request_adapters/CheckStartStateBounds'
[move_group-9] [INFO] [1748855345.798396178] [move_group]: Try loading adapter 'default_planning_request_adapters/CheckStartStateCollision'
[move_group-9] [INFO] [1748855345.798426578] [move_group]: Loaded adapter 'default_planning_request_adapters/CheckStartStateCollision'
[move_group-9] [INFO] [1748855345.802349495] [move_group]: Try loading adapter 'default_planning_response_adapters/ValidateSolution'
[move_group-9] [INFO] [1748855345.812264438] [move_group]: Loaded adapter 'default_planning_response_adapters/ValidateSolution'
[move_group-9] [INFO] [1748855345.812332638] [move_group]: Try loading adapter 'default_planning_response_adapters/DisplayMotionPath'
[move_group-9] [INFO] [1748855345.821645879] [move_group]: Loaded adapter 'default_planning_response_adapters/DisplayMotionPath'
[create-7] [INFO] [1748855345.862078853] [ros_gz_sim]: Entity creation successful.
[move_group-9] [INFO] [1748855345.868821082] [move_group.moveit.moveit.ros.planning_pipeline]: Successfully loaded planner 'OMPL'
[move_group-9] [INFO] [1748855345.875701312] [move_group]: Try loading adapter 'default_planning_request_adapters/ResolveConstraintFrames'
[move_group-9] [INFO] [1748855345.876168914] [move_group]: Loaded adapter 'default_planning_request_adapters/ResolveConstraintFrames'
[move_group-9] [INFO] [1748855345.876211114] [move_group]: Try loading adapter 'default_planning_request_adapters/ValidateWorkspaceBounds'
[move_group-9] [INFO] [1748855345.876790717] [move_group]: Loaded adapter 'default_planning_request_adapters/ValidateWorkspaceBounds'
[move_group-9] [INFO] [1748855345.876825117] [move_group]: Try loading adapter 'default_planning_request_adapters/CheckStartStateBounds'
[move_group-9] [INFO] [1748855345.879105627] [move_group]: Loaded adapter 'default_planning_request_adapters/CheckStartStateBounds'
[move_group-9] [INFO] [1748855345.879186927] [move_group]: Try loading adapter 'default_planning_request_adapters/CheckStartStateCollision'
[move_group-9] [INFO] [1748855345.879254527] [move_group]: Loaded adapter 'default_planning_request_adapters/CheckStartStateCollision'
[move_group-9] [INFO] [1748855345.885041752] [move_group]: Try loading adapter 'default_planning_response_adapters/AddTimeOptimalParameterization'
[move_group-9] [INFO] [1748855345.887489163] [move_group]: Loaded adapter 'default_planning_response_adapters/AddTimeOptimalParameterization'
[move_group-9] [INFO] [1748855345.887578863] [move_group]: Try loading adapter 'default_planning_response_adapters/ValidateSolution'
[move_group-9] [INFO] [1748855345.888547067] [move_group]: Loaded adapter 'default_planning_response_adapters/ValidateSolution'
[move_group-9] [INFO] [1748855345.888634668] [move_group]: Try loading adapter 'default_planning_response_adapters/DisplayMotionPath'
[move_group-9] [INFO] [1748855345.890325675] [move_group]: Loaded adapter 'default_planning_response_adapters/DisplayMotionPath'
[move_group-9] [INFO] [1748855346.049656560] [move_group.moveit.moveit.plugins.simple_controller_manager]: Added FollowJointTrajectory controller for arm_controller
[move_group-9] [INFO] [1748855346.049806460] [move_group.moveit.moveit.plugins.simple_controller_manager]: gripper_action_controller will command a max effort of: 0
[move_group-9] [INFO] [1748855346.052640572] [move_group.moveit.moveit.plugins.simple_controller_manager]: Added GripperCommand controller for gripper_action_controller
[move_group-9] [INFO] [1748855346.053046474] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855346.053130174] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855346.053672777] [move_group.moveit.moveit.ros.trajectory_execution_manager]: Trajectory execution is managing controllers
[move_group-9] [INFO] [1748855346.053715377] [move_group]: MoveGroup debug mode is ON
[INFO] [create-7]: process has finished cleanly [pid 55416]
[move_group-9] [INFO] [1748855346.130398902] [move_group.moveit.moveit.planners.pilz.move_group_sequence_action]: initialize move group sequence action
[move_group-9] [INFO] [1748855346.139927343] [move_group.moveit.moveit.planners.pilz.joint_limits_aggregator]: Reading limits from namespace robot_description_planning
[move_group-9] [INFO] [1748855346.140320945] [move_group.moveit.moveit.planners.pilz.joint_limits_aggregator]: Reading limits from namespace robot_description_planning
[move_group-9] [INFO] [1748855346.145073465] [move_group.moveit.moveit.ros.move_group.executable]:
[move_group-9]
[move_group-9] ********************************************************
[move_group-9] * MoveGroup using:
[move_group-9] * - apply_planning_scene_service
[move_group-9] * - clear_octomap_service
[move_group-9] * - ExecuteTaskSolution
[move_group-9] * - get_group_urdf
[move_group-9] * - load_geometry_from_file
[move_group-9] * - CartesianPathService
[move_group-9] * - execute_trajectory_action
[move_group-9] * - get_planning_scene_service
[move_group-9] * - kinematics_service
[move_group-9] * - move_action
[move_group-9] * - motion_plan_service
[move_group-9] * - query_planners_service
[move_group-9] * - state_validation_service
[move_group-9] * - save_geometry_to_file
[move_group-9] * - SequenceAction
[move_group-9] * - SequenceService
[move_group-9] ********************************************************
[move_group-9]
[move_group-9] [INFO] [1748855346.145191165] [move_group.moveit.moveit.ros.move_group.context]: MoveGroup context using pipeline pilz
[move_group-9] [INFO] [1748855346.145227965] [move_group.moveit.moveit.ros.move_group.context]: MoveGroup context initialization complete
[move_group-9] Loading 'move_group/ApplyPlanningSceneService'...
[move_group-9] Loading 'move_group/ClearOctomapService'...
[move_group-9] Loading 'move_group/ExecuteTaskSolutionCapability'...
[move_group-9] Loading 'move_group/GetUrdfService'...
[move_group-9] Loading 'move_group/LoadGeometryFromFileService'...
[move_group-9] Loading 'move_group/MoveGroupCartesianPathService'...
[move_group-9] Loading 'move_group/MoveGroupExecuteTrajectoryAction'...
[move_group-9] Loading 'move_group/MoveGroupGetPlanningSceneService'...
[move_group-9] Loading 'move_group/MoveGroupKinematicsService'...
[move_group-9] Loading 'move_group/MoveGroupMoveAction'...
[move_group-9] Loading 'move_group/MoveGroupPlanService'...
[move_group-9] Loading 'move_group/MoveGroupQueryPlannersService'...
[move_group-9] Loading 'move_group/MoveGroupStateValidationService'...
[move_group-9] Loading 'move_group/SaveGeometryToFileService'...
[move_group-9] Loading 'pilz_industrial_motion_planner/MoveGroupSequenceAction'...
[move_group-9] Loading 'pilz_industrial_motion_planner/MoveGroupSequenceService'...
[move_group-9]
[move_group-9] You can start planning now!
[move_group-9]
[gazebo-6] Warning [Utils.cc:132] [/sdf/model[@name="ur"]/joint[@name="wrist_3_joint"]/physics/ode/provide_feedback:<urdf-string>:L0]: XML Element[provide_feedback], child of element[ode], not defined in SDF. Copying[provide_feedback] as children of [ode].
[gazebo-6] [INFO] [1748855347.154343140] [gz_ros_control]: [gz_ros2_control] Fixed joint [base_joint] (Entity=76)] is skipped
[gazebo-6] [INFO] [1748855347.154559041] [gz_ros_control]: [gz_ros2_control] Fixed joint [world_to_start-storage_joint] (Entity=91)] is skipped
[gazebo-6] [INFO] [1748855347.154599741] [gz_ros_control]: [gz_ros2_control] Fixed joint [world_to_table_joint] (Entity=92)] is skipped
[gazebo-6] [INFO] [1748855347.157523953] [gz_ros_control]: Loading controller_manager
[gazebo-6] [INFO] [1748855347.190931393] [controller_manager]: Using ROS clock for triggering controller manager cycles.
[gazebo-6] [INFO] [1748855347.195778213] [controller_manager]: Subscribing to '/robot_description' topic for robot description.
[gazebo-6] [WARN] [1748855347.200594633] [gz_ros_control]: Waiting RM to load and initialize hardware...
[gazebo-6] [INFO] [1748855347.200945335] [controller_manager]: Received robot description from topic.
[gazebo-6] [INFO] [1748855347.211852380] [gz_ros_control]: The position_proportional_gain has been set to: 0.1
[gazebo-6] [INFO] [1748855347.212010781] [gz_ros_control]: Loading joint: shoulder_pan_joint
[gazebo-6] [INFO] [1748855347.212030481] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.212043681] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212091281] [gz_ros_control]: found initial value: 0.000000
[gazebo-6] [INFO] [1748855347.212111281] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212128181] [gz_ros_control]: effort
[gazebo-6] [INFO] [1748855347.212140881] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.212151481] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212174882] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212197882] [gz_ros_control]: Loading joint: shoulder_lift_joint
[gazebo-6] [INFO] [1748855347.212209882] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.212220182] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212234382] [gz_ros_control]: found initial value: -1.570000
[gazebo-6] [INFO] [1748855347.212245782] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212258082] [gz_ros_control]: effort
[gazebo-6] [INFO] [1748855347.212269582] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.212280582] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212297782] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212318882] [gz_ros_control]: Loading joint: elbow_joint
[gazebo-6] [INFO] [1748855347.212330482] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.212341182] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212353182] [gz_ros_control]: found initial value: 0.000000
[gazebo-6] [INFO] [1748855347.212383282] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212394683] [gz_ros_control]: effort
[gazebo-6] [INFO] [1748855347.212408283] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.212419383] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212436583] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212473483] [gz_ros_control]: Loading joint: wrist_1_joint
[gazebo-6] [INFO] [1748855347.212503483] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.212529783] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212560483] [gz_ros_control]: found initial value: -1.570000
[gazebo-6] [INFO] [1748855347.212572583] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212583283] [gz_ros_control]: effort
[gazebo-6] [INFO] [1748855347.212593483] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.212603083] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212634284] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212697884] [gz_ros_control]: Loading joint: wrist_2_joint
[gazebo-6] [INFO] [1748855347.212713084] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.212723784] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212736384] [gz_ros_control]: found initial value: 0.000000
[gazebo-6] [INFO] [1748855347.212748584] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212759184] [gz_ros_control]: effort
[gazebo-6] [INFO] [1748855347.212769384] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.212779484] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212797784] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212816784] [gz_ros_control]: Loading joint: wrist_3_joint
[gazebo-6] [INFO] [1748855347.212828084] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.212837984] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.212865484] [gz_ros_control]: found initial value: 0.000000
[gazebo-6] [INFO] [1748855347.212932285] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.212947585] [gz_ros_control]: effort
[gazebo-6] [INFO] [1748855347.212973785] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.212983585] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.213017885] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.213038885] [gz_ros_control]: Loading joint: robotiq_85_left_knuckle_joint
[gazebo-6] [INFO] [1748855347.213049885] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.213060585] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.213070885] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.213081785] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.213094285] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.213135286] [gz_ros_control]: Loading joint: robotiq_85_right_knuckle_joint
[gazebo-6] [INFO] [1748855347.213149986] [gz_ros_control]: Joint 'robotiq_85_right_knuckle_joint'is mimicking joint 'robotiq_85_left_knuckle_joint' with multiplier: 1 and offset: 0
[gazebo-6] [INFO] [1748855347.213162386] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.213175486] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.213193786] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.213222986] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.213243686] [gz_ros_control]: Loading joint: robotiq_85_left_inner_knuckle_joint
[gazebo-6] [INFO] [1748855347.213257186] [gz_ros_control]: Joint 'robotiq_85_left_inner_knuckle_joint'is mimicking joint 'robotiq_85_left_knuckle_joint' with multiplier: 1 and offset: 0
[gazebo-6] [INFO] [1748855347.213269186] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.213279886] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.213305486] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.213333886] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.213351887] [gz_ros_control]: Loading joint: robotiq_85_right_inner_knuckle_joint
[gazebo-6] [INFO] [1748855347.213364787] [gz_ros_control]: Joint 'robotiq_85_right_inner_knuckle_joint'is mimicking joint 'robotiq_85_left_knuckle_joint' with multiplier: 1 and offset: 0
[gazebo-6] [INFO] [1748855347.213376487] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.213386387] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.213396387] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.213421587] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.213457487] [gz_ros_control]: Loading joint: robotiq_85_left_finger_joint
[gazebo-6] [INFO] [1748855347.213468287] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.213478187] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.213488887] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.213498987] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.213516787] [gz_ros_control]: Loading joint: robotiq_85_right_finger_joint
[gazebo-6] [INFO] [1748855347.213527587] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.213537587] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.213547887] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.213557987] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.213576087] [gz_ros_control]: Loading joint: robotiq_85_left_finger_tip_joint
[gazebo-6] [INFO] [1748855347.213588987] [gz_ros_control]: Joint 'robotiq_85_left_finger_tip_joint'is mimicking joint 'robotiq_85_left_knuckle_joint' with multiplier: -1 and offset: 0
[gazebo-6] [INFO] [1748855347.213601288] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.213612188] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.213623188] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.213633788] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.213680688] [gz_ros_control]: Loading joint: robotiq_85_right_finger_tip_joint
[gazebo-6] [INFO] [1748855347.213698788] [gz_ros_control]: Joint 'robotiq_85_right_finger_tip_joint'is mimicking joint 'robotiq_85_left_knuckle_joint' with multiplier: -1 and offset: 0
[gazebo-6] [INFO] [1748855347.213712688] [gz_ros_control]: State:
[gazebo-6] [INFO] [1748855347.213723488] [gz_ros_control]: position
[gazebo-6] [INFO] [1748855347.213739788] [gz_ros_control]: velocity
[gazebo-6] [INFO] [1748855347.213751088] [gz_ros_control]: Command:
[gazebo-6] [INFO] [1748855347.213929189] [gz_ros_control.resource_manager]: Initialize hardware 'arm_controller'
[gazebo-6] [INFO] [1748855347.214191690] [gz_ros_control.resource_manager]: Successful initialization of hardware 'arm_controller'
[gazebo-6] [INFO] [1748855347.214613492] [resource_manager]: 'configure' hardware 'arm_controller'
[gazebo-6] [INFO] [1748855347.214666992] [gz_ros_control]: System Successfully configured!
[gazebo-6] [INFO] [1748855347.214692692] [resource_manager]: Successful 'configure' of hardware 'arm_controller'
[gazebo-6] [INFO] [1748855347.214716992] [resource_manager]: 'activate' hardware 'arm_controller'
[gazebo-6] [INFO] [1748855347.214736792] [resource_manager]: Successful 'activate' of hardware 'arm_controller'
[gazebo-6] [INFO] [1748855347.214816093] [controller_manager]: Resource Manager has been successfully initialized. Starting Controller Manager services...
[gazebo-6] [INFO] [1748855347.448132867] [controller_manager]: Loading controller : 'joint_state_broadcaster' of type 'joint_state_broadcaster/JointStateBroadcaster'
[gazebo-6] [INFO] [1748855347.448372468] [controller_manager]: Loading controller 'joint_state_broadcaster'
[gazebo-6] [INFO] [1748855347.462361527] [controller_manager]: Controller 'joint_state_broadcaster' node arguments: --ros-args --params-file /home/user/ros2_ws/install/mycobot_moveit/share/mycobot_moveit/config/ros2_controllers.yaml --ros-args -p use_sim_time:=true --param use_sim_time:=true
[spawner-10] [INFO] [1748855347.487199530] [spawner_joint_state_broadcaster]: Loaded joint_state_broadcaster
[gazebo-6] [INFO] [1748855347.488693437] [controller_manager]: Configuring controller: 'joint_state_broadcaster'
[gazebo-6] [INFO] [1748855347.489513340] [joint_state_broadcaster]: 'joints' or 'interfaces' parameter is empty. All available state interfaces will be published
[gazebo-6] [INFO] [1748855347.503615699] [controller_manager]: Activating controllers: [ joint_state_broadcaster ]
[gazebo-6] [Err] [Physics.cc:1785] Attempting to create a mimic constraint for joint [robotiq_85_left_inner_knuckle_joint] but the chosen physics engine does not support mimic constraints, so no constraint will be created.
[gazebo-6] [WARN] [1748855349.532907834] [gz_ros_control]: Desired controller update period (0.01 s) is slower than the gazebo simulation period (0.001 s).
[gazebo-6] NVD3D10: CPU cyclestats are disabled on client virtualization
[gazebo-6] NVD3D10: CPU cyclestats are disabled on client virtualization
[gazebo-6] NVD3D10: CPU cyclestats are disabled on client virtualization
[gazebo-6] Warning [Utils.cc:132] [/sdf/model[@name="ur"]/joint[@name="wrist_3_joint"]/physics/ode/provide_feedback:<data-string>:L331]: XML Element[provide_feedback], child of element[ode], not defined in SDF. Copying[provide_feedback] as children of [ode].
[gazebo-6] Warning [Utils.cc:132] [/sdf/model[@name="ur"]/joint[@name="wrist_3_joint"]/physics/ode/provide_feedback:<data-string>:L331]: XML Element[provide_feedback], child of element[ode], not defined in SDF. Copying[provide_feedback] as children of [ode].
[gazebo-6] [INFO] [1748855351.984210034] [controller_manager]: Successfully switched controllers!
[spawner-10] [INFO] [1748855352.002073797] [spawner_joint_state_broadcaster]: Configured and activated joint_state_broadcaster
[gazebo-6] NVD3D10: CPU cyclestats are disabled on client virtualization
[gazebo-6] NVD3D10: CPU cyclestats are disabled on client virtualization
[gazebo-6] NVD3D10: CPU cyclestats are disabled on client virtualization
[INFO] [spawner-10]: process has finished cleanly [pid 55421]
[INFO] [spawner-11]: process started with pid [55729]
[INFO] [rviz2-12]: process started with pid [55730]
[gazebo-6] [INFO] [1748855354.583917355] [controller_manager]: Loading controller : 'arm_controller' of type 'joint_trajectory_controller/JointTrajectoryController'
[gazebo-6] [INFO] [1748855354.584054055] [controller_manager]: Loading controller 'arm_controller'
[gazebo-6] [INFO] [1748855354.599413150] [controller_manager]: Controller 'arm_controller' node arguments: --ros-args --params-file /home/user/ros2_ws/install/mycobot_moveit/share/mycobot_moveit/config/ros2_controllers.yaml --ros-args -p use_sim_time:=true --param use_sim_time:=true
[spawner-11] [INFO] [1748855354.723775213] [spawner_arm_controller]: Loaded arm_controller
[gazebo-6] [INFO] [1748855354.737630808] [controller_manager]: Configuring controller: 'arm_controller'
[gazebo-6] [INFO] [1748855354.737986408] [arm_controller]: No specific joint names are used for command interfaces. Using 'joints' parameter.
[gazebo-6] [INFO] [1748855354.738102608] [arm_controller]: Command interfaces are [position velocity] and state interfaces are [position velocity].
[gazebo-6] [INFO] [1748855354.738183908] [arm_controller]: Using 'splines' interpolation method.
[gazebo-6] [INFO] [1748855354.744447106] [arm_controller]: Action status changes will be monitored at 20.00 Hz.
[gazebo-6] [INFO] [1748855354.797396390] [controller_manager]: Activating controllers: [ arm_controller ]
[gazebo-6] [INFO] [1748855354.805873888] [controller_manager]: Successfully switched controllers!
[spawner-11] [INFO] [1748855354.833197179] [spawner_arm_controller]: Configured and activated arm_controller
[INFO] [spawner-11]: process has finished cleanly [pid 55729]
[INFO] [spawner-13]: process started with pid [55767]
[img_pubsub-5] NVD3D10: CPU cyclestats are disabled on client virtualization
[img_pubsub-5] NVD3D10: CPU cyclestats are disabled on client virtualization
[gazebo-6] [INFO] [1748855356.330377810] [controller_manager]: Loading controller : 'gripper_action_controller' of type 'position_controllers/GripperActionController'
[gazebo-6] [INFO] [1748855356.330475610] [controller_manager]: Loading controller 'gripper_action_controller'
[gazebo-6] [INFO] [1748855356.340981505] [controller_manager]: Controller 'gripper_action_controller' node arguments: --ros-args --params-file /home/user/ros2_ws/install/mycobot_moveit/share/mycobot_moveit/config/ros2_controllers.yaml --ros-args -p use_sim_time:=true --param use_sim_time:=true
[gazebo-6] [WARN] [1748855356.371282892] [gripper_action_controller]: [Deprecated]: the `position_controllers/GripperActionController` and `effort_controllers::GripperActionController` controllers are replaced by 'parallel_gripper_controllers/GripperActionController' controller
[spawner-13] [INFO] [1748855356.437866363] [spawner_gripper_action_controller]: Loaded gripper_action_controller
[gazebo-6] [INFO] [1748855356.442131461] [controller_manager]: Configuring controller: 'gripper_action_controller'
[gazebo-6] [INFO] [1748855356.442300061] [gripper_action_controller]: Action status changes will be monitored at 20.000000 Hz.
[gazebo-6] [INFO] [1748855356.469997048] [controller_manager]: Activating controllers: [ gripper_action_controller ]
[gazebo-6] [INFO] [1748855356.497819936] [controller_manager]: Successfully switched controllers!
[rviz2-12] [INFO] [1748855356.504710133] [rviz2]: Stereo is NOT SUPPORTED
[rviz2-12] [INFO] [1748855356.504996133] [rviz2]: OpenGl version: 4.2 (GLSL 4.2)
[spawner-13] [INFO] [1748855356.523249525] [spawner_gripper_action_controller]: Configured and activated gripper_action_controller
[rviz2-12] [INFO] [1748855356.642680572] [rviz2]: Stereo is NOT SUPPORTED
[INFO] [spawner-13]: process has finished cleanly [pid 55767]
[rviz2-12] NVD3D10: CPU cyclestats are disabled on client virtualization
[rviz2-12] NVD3D10: CPU cyclestats are disabled on client virtualization
[rviz2-12] NVD3D10: CPU cyclestats are disabled on client virtualization
[rviz2-12] Warning: class_loader.impl: SEVERE WARNING!!! A namespace collision has occurred with plugin factory for class rviz_default_plugins::displays::InteractiveMarkerDisplay. New factory will OVERWRITE existing one. This situation occurs when libraries containing plugins are directly linked against an executable (the one running right now generating this message). Please separate plugins out into their own library or just don't link against the library and use either class_loader::ClassLoader/MultiLibraryClassLoader to open.
[rviz2-12] at line 321 in /opt/ros/jazzy/include/class_loader/class_loader/class_loader_core.hpp
[rviz2-12] [WARN] [1748855356.953483435] [rcl.logging_rosout]: Publisher already registered for node name: 'rviz2'. If this is due to multiple nodes with the same name then all logs for the logger named 'rviz2' will go out over the existing publisher. As soon as any node with that name is destructed it will unregister the publisher, preventing any further logs for that name from being published on the rosout topic.
[rviz2-12] [INFO] [1748855356.998503115] [rviz2.moveit.ros.rdf_loader]: Loaded robot model in 0.013491 seconds
[rviz2-12] [INFO] [1748855356.998754215] [rviz2.moveit.core.robot_model]: Loading robot model 'ur'...
[rviz2-12] [INFO] [1748855356.998817115] [rviz2.moveit.core.robot_model]: No root/virtual joint specified in SRDF. Assuming fixed joint
[rviz2-12] [ERROR] [1748855361.872683136] [rviz2.moveit.ros.motion_planning_frame]: Action server: /recognize_objects not available
[rviz2-12] [INFO] [1748855361.939605724] [rviz2.moveit.ros.motion_planning_frame]: MoveGroup namespace changed: / -> . Reloading params.
[rviz2-12] [WARN] [1748855362.024796261] [rcl.logging_rosout]: Publisher already registered for node name: 'rviz2'. If this is due to multiple nodes with the same name then all logs for the logger named 'rviz2' will go out over the existing publisher. As soon as any node with that name is destructed it will unregister the publisher, preventing any further logs for that name from being published on the rosout topic.
[rviz2-12] [INFO] [1748855362.085571828] [rviz2.moveit.ros.rdf_loader]: Loaded robot model in 0.00486671 seconds
[rviz2-12] [INFO] [1748855362.085807428] [rviz2.moveit.core.robot_model]: Loading robot model 'ur'...
[rviz2-12] [INFO] [1748855362.085866328] [rviz2.moveit.core.robot_model]: No root/virtual joint specified in SRDF. Assuming fixed joint
[rviz2-12] [INFO] [1748855362.342027129] [rviz2.moveit.kinematics.kdl_kinematics_plugin]: Joint weights for group 'arm_controller': 1 1 1 1 1 1
[rviz2-12] [INFO] [1748855362.878976099] [rviz2.moveit.ros.planning_scene_monitor]: Starting planning scene monitor
[rviz2-12] [INFO] [1748855362.882154908] [rviz2.moveit.ros.planning_scene_monitor]: Listening to '/monitored_planning_scene'
[rviz2-12] [INFO] [1748855362.914869397] [interactive_marker_display_101162029286400]: Connected on namespace: /rviz_moveit_motion_planning_display/robot_interaction_interactive_marker_topic
[rviz2-12] [INFO] [1748855362.997848324] [rviz2.moveit.ros.motion_planning_frame]: group arm_controller
[rviz2-12] [INFO] [1748855362.997956224] [rviz2.moveit.ros.motion_planning_frame]: Constructing new MoveGroup connection for group 'arm_controller' in namespace ''
[rviz2-12] [INFO] [1748855363.030569912] [rviz2.moveit.ros.move_group_interface]: Ready to take commands for planning group arm_controller.
[rviz2-12] [INFO] [1748855363.033620920] [rviz2.moveit.ros.motion_planning_frame]: group arm_controller
[rviz2-12] [INFO] [1748855363.034010321] [rviz2.moveit.ros.motion_planning_frame]: group arm_controller
[rviz2-12] [INFO] [1748855363.120174951] [interactive_marker_display_101162029286400]: Sending request for interactive markers
[rviz2-12] [INFO] [1748855363.181088114] [interactive_marker_display_101162029286400]: Service response received for initialization
[gazebo-6] NodeShared::Publish() Error: Interrupted system call
[rviz2-12] [INFO] [1748855401.620782815] [rviz_push_button_node]: Workpieces spawned!
[mtc_node-4] [INFO] [1748855401.621227215] [mycobot_mtc]: Received button1 press (true). Attempting to setup planning scene...
[mtc_node-4] [INFO] [1748855401.621290914] [mycobot_mtc]: Setting up planning scene...
[mtc_node-4] [WARN] [1748855401.671087149] [rcl.logging_rosout]: Publisher already registered for node name: 'mtc_node'. If this is due to multiple nodes with the same name then all logs for the logger named 'mtc_node' will go out over the existing publisher. As soon as any node with that name is destructed it will unregister the publisher, preventing any further logs for that name from being published on the rosout topic.
[mtc_node-4] [INFO] [1748855401.731708269] [mycobot_mtc]: Detected TF Yaw close to 0 or 180 degrees (0.00 rad) for smaller objects layout.
[mtc_node-4] [INFO] [1748855401.731793369] [mycobot_mtc]: Adding object 0 at (-0.010, -0.417, 0.947) based on TF.
[mtc_node-4] [INFO] [1748855401.731818569] [mycobot_mtc]: Adding object 1 at (-0.070, -0.417, 0.947) based on TF.
[mtc_node-4] [INFO] [1748855401.731836369] [mycobot_mtc]: Adding object 2 at (-0.130, -0.417, 0.947) based on TF.
[mtc_node-4] [INFO] [1748855401.731859369] [mycobot_mtc]: Adding object 3 at (-0.010, -0.353, 0.947) based on TF.
[mtc_node-4] [INFO] [1748855401.731879069] [mycobot_mtc]: Adding object 4 at (-0.070, -0.353, 0.947) based on TF.
[mtc_node-4] [INFO] [1748855401.731898069] [mycobot_mtc]: Adding object 5 at (-0.130, -0.353, 0.947) based on TF.
[mtc_node-4] [INFO] [1748855401.735099065] [mycobot_mtc]: Applied 6 smaller collision objects based on TF.
[rviz2-12] [INFO] [1748855403.866860792] [rviz_push_button_node]: Run MTC
[mtc_node-4] [INFO] [1748855403.867266691] [mycobot_mtc]: Received button2 press (true). Running MTC task...
[mtc_node-4] [INFO] [1748855403.867320891] [mycobot_mtc]: Setting target place pose for THIS task run to (-0.189, 0.381, 0.947)
[mtc_node-4] [WARN] [1748855403.868378990] [rcl.logging_rosout]: Publisher already registered for node name: 'mtc_node'. If this is due to multiple nodes with the same name then all logs for the logger named 'mtc_node' will go out over the existing publisher. As soon as any node with that name is destructed it will unregister the publisher, preventing any further logs for that name from being published on the rosout topic.
[gazebo-6] [INFO] [1748855403.929063902] [controller_manager]: Received robot description from topic.
[gazebo-6] [WARN] [1748855403.929208402] [controller_manager]: ResourceManager has already loaded a urdf. Ignoring attempt to reload a robot description.
[mtc_node-4] [INFO] [1748855403.930198201] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.rdf_loader]: Loaded robot model in 0.006 seconds
[mtc_node-4] [INFO] [1748855403.930435100] [planning_scene_interface_140666822783792.mtc_node.moveit.core.robot_model]: Loading robot model 'ur'...
[mtc_node-4] [INFO] [1748855403.930486700] [planning_scene_interface_140666822783792.mtc_node.moveit.core.robot_model]: No root/virtual joint specified in SRDF. Assuming fixed joint
[mtc_node-4] [INFO] [1748855404.122623616] [planning_scene_interface_140666822783792.mtc_node.moveit.kinematics.kdl_kinematics_plugin]: Joint weights for group 'arm_controller': 1 1 1 1 1 1
[mtc_node-4] [INFO] [1748855404.218151873] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.planning_pipeline]: Successfully loaded planner 'OMPL'
[mtc_node-4] [INFO] [1748855404.225965861] [mtc_node]: Try loading adapter 'default_planning_request_adapters/ResolveConstraintFrames'
[mtc_node-4] [INFO] [1748855404.231345453] [mtc_node]: Loaded adapter 'default_planning_request_adapters/ResolveConstraintFrames'
[mtc_node-4] [INFO] [1748855404.231392553] [mtc_node]: Try loading adapter 'default_planning_request_adapters/ValidateWorkspaceBounds'
[mtc_node-4] [INFO] [1748855404.232062352] [mtc_node]: Loaded adapter 'default_planning_request_adapters/ValidateWorkspaceBounds'
[mtc_node-4] [INFO] [1748855404.232111452] [mtc_node]: Try loading adapter 'default_planning_request_adapters/CheckStartStateBounds'
[mtc_node-4] [INFO] [1748855404.232196152] [mtc_node]: Loaded adapter 'default_planning_request_adapters/CheckStartStateBounds'
[mtc_node-4] [INFO] [1748855404.232209552] [mtc_node]: Try loading adapter 'default_planning_request_adapters/CheckStartStateCollision'
[mtc_node-4] [INFO] [1748855404.232242251] [mtc_node]: Loaded adapter 'default_planning_request_adapters/CheckStartStateCollision'
[mtc_node-4] [INFO] [1748855404.245956231] [mtc_node]: Try loading adapter 'default_planning_response_adapters/AddTimeOptimalParameterization'
[mtc_node-4] [INFO] [1748855404.254515818] [mtc_node]: Loaded adapter 'default_planning_response_adapters/AddTimeOptimalParameterization'
[mtc_node-4] [INFO] [1748855404.254555718] [mtc_node]: Try loading adapter 'default_planning_response_adapters/ValidateSolution'
[mtc_node-4] [INFO] [1748855404.257088514] [mtc_node]: Loaded adapter 'default_planning_response_adapters/ValidateSolution'
[mtc_node-4] [INFO] [1748855404.257143414] [mtc_node]: Try loading adapter 'default_planning_response_adapters/DisplayMotionPath'
[mtc_node-4] [INFO] [1748855404.263203905] [mtc_node]: Loaded adapter 'default_planning_response_adapters/DisplayMotionPath'
[mtc_node-4] [INFO] [1748855404.265929601] [mycobot_mtc]: Task initialized. Planning...
[mtc_node-4] [INFO] [1748855407.192788383] [mtc_node]: Calling PlanningRequestAdapter 'ResolveConstraintFrames'
[mtc_node-4] [INFO] [1748855407.193134983] [mtc_node]: Calling PlanningRequestAdapter 'ValidateWorkspaceBounds'
[mtc_node-4] [WARN] [1748855407.193154983] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.validate_workspace_bounds]: It looks like the planning volume was not specified. Using default values.
[mtc_node-4] [INFO] [1748855407.193348282] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateBounds'
[mtc_node-4] [INFO] [1748855407.193618382] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateCollision'
[mtc_node-4] [INFO] [1748855407.196764877] [planning_scene_interface_140666822783792.mtc_node.moveit.planners.ompl.model_based_planning_context]: Planner configuration 'arm_controller' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
[mtc_node-4] [INFO] [1748855407.197645875] [mtc_node]: Calling Planner 'OMPL'
[mtc_node-4] [INFO] [1748855407.307220590] [mtc_node]: Calling PlanningResponseAdapter 'AddTimeOptimalParameterization'
[mtc_node-4] [INFO] [1748855407.308646888] [mtc_node]: Calling PlanningResponseAdapter 'ValidateSolution'
[mtc_node-4] [INFO] [1748855407.311730783] [mtc_node]: Calling PlanningResponseAdapter 'DisplayMotionPath'
[mtc_node-4] [WARN] [1748855407.312849081] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.planning_pipeline]: The planner plugin did not fill out the 'planner_id' field of the MotionPlanResponse. Setting it to the planner ID name of the MotionPlanRequest assuming that the planner plugin does warn you if it does not use the requested planner.
[mtc_node-4] [INFO] [1748855407.351405916] [mtc_node]: Calling PlanningRequestAdapter 'ResolveConstraintFrames'
[mtc_node-4] [INFO] [1748855407.351850515] [mtc_node]: Calling PlanningRequestAdapter 'ValidateWorkspaceBounds'
[mtc_node-4] [WARN] [1748855407.351881615] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.validate_workspace_bounds]: It looks like the planning volume was not specified. Using default values.
[mtc_node-4] [INFO] [1748855407.352192914] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateBounds'
[mtc_node-4] [INFO] [1748855407.352473714] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateCollision'
[mtc_node-4] [INFO] [1748855407.353909011] [planning_scene_interface_140666822783792.mtc_node.moveit.planners.ompl.model_based_planning_context]: Planner configuration 'arm_controller' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
[mtc_node-4] [INFO] [1748855407.354344411] [mtc_node]: Calling Planner 'OMPL'
[mtc_node-4] [INFO] [1748855407.430938381] [mtc_node]: Calling PlanningResponseAdapter 'AddTimeOptimalParameterization'
[mtc_node-4] [INFO] [1748855407.433302977] [mtc_node]: Calling PlanningResponseAdapter 'ValidateSolution'
[mtc_node-4] [INFO] [1748855407.436792471] [mtc_node]: Calling PlanningResponseAdapter 'DisplayMotionPath'
[mtc_node-4] [WARN] [1748855407.437324271] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.planning_pipeline]: The planner plugin did not fill out the 'planner_id' field of the MotionPlanResponse. Setting it to the planner ID name of the MotionPlanRequest assuming that the planner plugin does warn you if it does not use the requested planner.
[mtc_node-4] [INFO] [1748855407.504074158] [mtc_node]: Calling PlanningRequestAdapter 'ResolveConstraintFrames'
[mtc_node-4] [INFO] [1748855407.504509857] [mtc_node]: Calling PlanningRequestAdapter 'ValidateWorkspaceBounds'
[mtc_node-4] [WARN] [1748855407.504538957] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.validate_workspace_bounds]: It looks like the planning volume was not specified. Using default values.
[mtc_node-4] [INFO] [1748855407.504766557] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateBounds'
[mtc_node-4] [INFO] [1748855407.504911956] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateCollision'
[mtc_node-4] [INFO] [1748855407.506194154] [planning_scene_interface_140666822783792.mtc_node.moveit.planners.ompl.model_based_planning_context]: Planner configuration 'arm_controller' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
[mtc_node-4] [INFO] [1748855407.506387054] [mtc_node]: Calling Planner 'OMPL'
[mtc_node-4] [INFO] [1748855407.625578253] [mtc_node]: Calling PlanningResponseAdapter 'AddTimeOptimalParameterization'
[mtc_node-4] [INFO] [1748855407.626934350] [mtc_node]: Calling PlanningResponseAdapter 'ValidateSolution'
[mtc_node-4] [INFO] [1748855407.630832644] [mtc_node]: Calling PlanningResponseAdapter 'DisplayMotionPath'
[mtc_node-4] [WARN] [1748855407.631540943] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.planning_pipeline]: The planner plugin did not fill out the 'planner_id' field of the MotionPlanResponse. Setting it to the planner ID name of the MotionPlanRequest assuming that the planner plugin does warn you if it does not use the requested planner.
[mtc_node-4] [INFO] [1748855408.728815346] [mtc_node]: Calling PlanningRequestAdapter 'ResolveConstraintFrames'
[mtc_node-4] [INFO] [1748855408.729317645] [mtc_node]: Calling PlanningRequestAdapter 'ValidateWorkspaceBounds'
[mtc_node-4] [WARN] [1748855408.729347045] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.validate_workspace_bounds]: It looks like the planning volume was not specified. Using default values.
[mtc_node-4] [INFO] [1748855408.729506744] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateBounds'
[mtc_node-4] [INFO] [1748855408.729679344] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateCollision'
[mtc_node-4] [INFO] [1748855408.731837840] [planning_scene_interface_140666822783792.mtc_node.moveit.planners.ompl.model_based_planning_context]: Planner configuration 'arm_controller' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
[mtc_node-4] [INFO] [1748855408.732585339] [mtc_node]: Calling Planner 'OMPL'
[mtc_node-4] [INFO] [1748855408.917971315] [mtc_node]: Calling PlanningResponseAdapter 'AddTimeOptimalParameterization'
[mtc_node-4] [INFO] [1748855408.921839808] [mtc_node]: Calling PlanningResponseAdapter 'ValidateSolution'
[mtc_node-4] [INFO] [1748855408.927851197] [mtc_node]: Calling PlanningResponseAdapter 'DisplayMotionPath'
[mtc_node-4] [WARN] [1748855408.928518096] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.planning_pipeline]: The planner plugin did not fill out the 'planner_id' field of the MotionPlanResponse. Setting it to the planner ID name of the MotionPlanRequest assuming that the planner plugin does warn you if it does not use the requested planner.
[mtc_node-4] [INFO] [1748855408.979622807] [mtc_node]: Calling PlanningRequestAdapter 'ResolveConstraintFrames'
[mtc_node-4] [INFO] [1748855408.979882006] [mtc_node]: Calling PlanningRequestAdapter 'ValidateWorkspaceBounds'
[mtc_node-4] [WARN] [1748855408.979899606] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.validate_workspace_bounds]: It looks like the planning volume was not specified. Using default values.
[mtc_node-4] [INFO] [1748855408.980076806] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateBounds'
[mtc_node-4] [INFO] [1748855408.980331205] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateCollision'
[mtc_node-4] [INFO] [1748855408.981480903] [planning_scene_interface_140666822783792.mtc_node.moveit.planners.ompl.model_based_planning_context]: Planner configuration 'arm_controller' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
[mtc_node-4] [INFO] [1748855408.981686303] [mtc_node]: Calling Planner 'OMPL'
[mtc_node-4] [INFO] [1748855409.147079005] [mtc_node]: Calling PlanningResponseAdapter 'AddTimeOptimalParameterization'
[mtc_node-4] [INFO] [1748855409.151222597] [mtc_node]: Calling PlanningResponseAdapter 'ValidateSolution'
[mtc_node-4] [INFO] [1748855409.156395188] [mtc_node]: Calling PlanningResponseAdapter 'DisplayMotionPath'
[mtc_node-4] [WARN] [1748855409.157214787] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.planning_pipeline]: The planner plugin did not fill out the 'planner_id' field of the MotionPlanResponse. Setting it to the planner ID name of the MotionPlanRequest assuming that the planner plugin does warn you if it does not use the requested planner.
[mtc_node-4] [INFO] [1748855409.203350003] [mtc_node]: Calling PlanningRequestAdapter 'ResolveConstraintFrames'
[mtc_node-4] [INFO] [1748855409.203613302] [mtc_node]: Calling PlanningRequestAdapter 'ValidateWorkspaceBounds'
[mtc_node-4] [WARN] [1748855409.203634402] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.validate_workspace_bounds]: It looks like the planning volume was not specified. Using default values.
[mtc_node-4] [INFO] [1748855409.203854702] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateBounds'
[mtc_node-4] [INFO] [1748855409.204108002] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateCollision'
[mtc_node-4] [INFO] [1748855409.204955200] [planning_scene_interface_140666822783792.mtc_node.moveit.planners.ompl.model_based_planning_context]: Planner configuration 'arm_controller' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
[mtc_node-4] [INFO] [1748855409.205163100] [mtc_node]: Calling Planner 'OMPL'
[mtc_node-4] [INFO] [1748855409.300730927] [mtc_node]: Calling PlanningResponseAdapter 'AddTimeOptimalParameterization'
[mtc_node-4] [INFO] [1748855409.303731921] [mtc_node]: Calling PlanningResponseAdapter 'ValidateSolution'
[mtc_node-4] [INFO] [1748855409.307953213] [mtc_node]: Calling PlanningResponseAdapter 'DisplayMotionPath'
[mtc_node-4] [WARN] [1748855409.308562412] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.planning_pipeline]: The planner plugin did not fill out the 'planner_id' field of the MotionPlanResponse. Setting it to the planner ID name of the MotionPlanRequest assuming that the planner plugin does warn you if it does not use the requested planner.
[mtc_node-4] [INFO] [1748855409.311473407] [mtc_node]: Calling PlanningRequestAdapter 'ResolveConstraintFrames'
[mtc_node-4] [INFO] [1748855409.312121006] [mtc_node]: Calling PlanningRequestAdapter 'ValidateWorkspaceBounds'
[mtc_node-4] [WARN] [1748855409.312159306] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.validate_workspace_bounds]: It looks like the planning volume was not specified. Using default values.
[mtc_node-4] [INFO] [1748855409.313138404] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateBounds'
[mtc_node-4] [INFO] [1748855409.313653203] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateCollision'
[mtc_node-4] [INFO] [1748855409.316081999] [planning_scene_interface_140666822783792.mtc_node.moveit.planners.ompl.model_based_planning_context]: Planner configuration 'arm_controller' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
[mtc_node-4] [INFO] [1748855409.316398698] [mtc_node]: Calling Planner 'OMPL'
[mtc_node-4] [INFO] [1748855409.500350042] [mtc_node]: Calling PlanningResponseAdapter 'AddTimeOptimalParameterization'
[mtc_node-4] [INFO] [1748855409.503375896] [mtc_node]: Calling PlanningResponseAdapter 'ValidateSolution'
[mtc_node-4] [INFO] [1748855409.510493822] [mtc_node]: Calling PlanningResponseAdapter 'DisplayMotionPath'
[mtc_node-4] [WARN] [1748855409.513143768] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.planning_pipeline]: The planner plugin did not fill out the 'planner_id' field of the MotionPlanResponse. Setting it to the planner ID name of the MotionPlanRequest assuming that the planner plugin does warn you if it does not use the requested planner.
[mtc_node-4] [INFO] [1748855409.618924538] [mtc_node]: Calling PlanningRequestAdapter 'ResolveConstraintFrames'
[mtc_node-4] [INFO] [1748855409.619248643] [mtc_node]: Calling PlanningRequestAdapter 'ValidateWorkspaceBounds'
[mtc_node-4] [WARN] [1748855409.619267144] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.validate_workspace_bounds]: It looks like the planning volume was not specified. Using default values.
[mtc_node-4] [INFO] [1748855409.619578149] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateBounds'
[mtc_node-4] [INFO] [1748855409.619748452] [mtc_node]: Calling PlanningRequestAdapter 'CheckStartStateCollision'
[mtc_node-4] [INFO] [1748855409.621090176] [planning_scene_interface_140666822783792.mtc_node.moveit.planners.ompl.model_based_planning_context]: Planner configuration 'arm_controller' will use planner 'geometric::RRTConnect'. Additional configuration parameters will be set when the planner is constructed.
[mtc_node-4] [INFO] [1748855409.622348498] [mtc_node]: Calling Planner 'OMPL'
[mtc_node-4] [INFO] [1748855409.769633401] [mtc_node]: Calling PlanningResponseAdapter 'AddTimeOptimalParameterization'
[mtc_node-4] [INFO] [1748855409.773822775] [mtc_node]: Calling PlanningResponseAdapter 'ValidateSolution'
[mtc_node-4] [INFO] [1748855409.779567776] [mtc_node]: Calling PlanningResponseAdapter 'DisplayMotionPath'
[mtc_node-4] [WARN] [1748855409.780449192] [planning_scene_interface_140666822783792.mtc_node.moveit.ros.planning_pipeline]: The planner plugin did not fill out the 'planner_id' field of the MotionPlanResponse. Setting it to the planner ID name of the MotionPlanRequest assuming that the planner plugin does warn you if it does not use the requested planner.
[mtc_node-4] [INFO] [1748855409.998481045] [mycobot_mtc]: Task planning succeeded. Publishing solution...
[mtc_node-4] [INFO] [1748855410.008756226] [mycobot_mtc]: Executing task...
[move_group-9] [WARN] [1748855410.082569626] [moveit_task_constructor_visualization.execute_task_solution]: The trajectory of stage '3' from task '' does not have any controllers specified for trajectory execution. This might lead to unexpected controller selection.
[move_group-9] [WARN] [1748855410.082910932] [moveit_task_constructor_visualization.execute_task_solution]: The trajectory of stage '4' from task '' does not have any controllers specified for trajectory execution. This might lead to unexpected controller selection.
[move_group-9] [WARN] [1748855410.083657245] [moveit_task_constructor_visualization.execute_task_solution]: The trajectory of stage '6' from task '' does not have any controllers specified for trajectory execution. This might lead to unexpected controller selection.
[move_group-9] [WARN] [1748855410.084145554] [moveit_task_constructor_visualization.execute_task_solution]: The trajectory of stage '10' from task '' does not have any controllers specified for trajectory execution. This might lead to unexpected controller selection.
[move_group-9] [WARN] [1748855410.085053570] [moveit_task_constructor_visualization.execute_task_solution]: The trajectory of stage '12' from task '' does not have any controllers specified for trajectory execution. This might lead to unexpected controller selection.
[move_group-9] [WARN] [1748855410.085595579] [moveit_task_constructor_visualization.execute_task_solution]: The trajectory of stage '14' from task '' does not have any controllers specified for trajectory execution. This might lead to unexpected controller selection.
[move_group-9] [WARN] [1748855410.085968786] [moveit_task_constructor_visualization.execute_task_solution]: The trajectory of stage '18' from task '' does not have any controllers specified for trajectory execution. This might lead to unexpected controller selection.
[move_group-9] [WARN] [1748855410.086325092] [moveit_task_constructor_visualization.execute_task_solution]: The trajectory of stage '20' from task '' does not have any controllers specified for trajectory execution. This might lead to unexpected controller selection.
[move_group-9] [INFO] [1748855410.086358693] [moveit_task_constructor_visualization.execute_task_solution]: Executing TaskSolution
[move_group-9] [INFO] [1748855410.086485195] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.086590497] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.086680498] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.086767300] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.086891002] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.086948003] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087032405] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087064605] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087191207] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087234108] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087356610] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087397611] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087452712] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087544414] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087638215] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087677816] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.087887220] [move_group.moveit.moveit.ros.trajectory_execution_manager]: Validating trajectory with allowed_start_tolerance 0.01
[move_group-9] [INFO] [1748855410.101703163] [move_group.moveit.moveit.ros.trajectory_execution_manager]: Starting trajectory execution ...
[move_group-9] Stack trace (most recent call last) in thread 55898:
[move_group-9] [INFO] [1748855410.104321009] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.104548213] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.106331044] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[move_group-9] [INFO] [1748855410.106493747] [move_group.moveit.moveit.plugins.simple_controller_manager]: Returned 2 controllers in list
[gazebo-6] [INFO] [1748855410.107822571] [gripper_action_controller]: Received & accepted new action goal
[move_group-9] #10 Object "", at 0xffffffffffffffff, in
[move_group-9] #9 Source "../sysdeps/unix/sysv/linux/x86_64/clone3.S", line 78, in clone3 [0x7c44c2129c3b]
[move_group-9] #8 Source "./nptl/pthread_create.c", line 447, in start_thread [0x7c44c209caa3]
[move_group-9] #7 Source "../../../../../src/libstdc++-v3/src/c++11/thread.cc", line 104, in execute_native_thread_routine [0x7c44c24ecdb3]
[move_group-9] #6 Object "/home/user/ros2_ws/install/moveit_task_constructor_capabilities/lib/libmoveit_task_constructor_capabilities.so", at 0x7c4475e9d157, in std::__future_base::_Async_state_impl<std::thread::_Invoker<std::tuple<void (move_group::ExecuteTaskSolutionCapability::*)(std::shared_ptr<rclcpp_action::ServerGoalHandle<moveit_task_constructor_msgs::action::ExecuteTaskSolution> > const&), move_group::ExecuteTaskSolutionCapability*, std::shared_ptr<rclcpp_action::ServerGoalHandle<moveit_task_constructor_msgs::action::ExecuteTaskSolution> > > >, void>::_M_run()
[move_group-9] #5 Source "./nptl/pthread_once.c", line 116, in __pthread_once_slow [0x7c44c20a1ed2]
[move_group-9] #4 | Source "/usr/include/c++/13/future", line 589, in operator()
[move_group-9] | 587: _M_do_set(function<_Ptr_type()>* __f, bool* __did_set)
[move_group-9] | 588: {
[move_group-9] | > 589: _Ptr_type __res = (*__f)();
[move_group-9] | 590: // Notify the caller that we did try to set; if we do not throw an
[move_group-9] | 591: // exception, the caller will be aware that it did set (e.g., see
[move_group-9] Source "/usr/include/c++/13/bits/std_function.h", line 591, in _M_do_set [0x7c44c2bc97f1]
[move_group-9] 588: {
[move_group-9] 589: if (_M_empty())
[move_group-9] 590: __throw_bad_function_call();
[move_group-9] > 591: return _M_invoker(_M_functor, std::forward<_ArgTypes>(__args)...);
[move_group-9] 592: }
[move_group-9] 593:
[move_group-9] 594: #if __cpp_rtti
[move_group-9] #3 Object "/home/user/ros2_ws/install/moveit_task_constructor_capabilities/lib/libmoveit_task_constructor_capabilities.so", at 0x7c4475e9bd1f, in std::_Function_handler<std::unique_ptr<std::__future_base::_Result_base, std::__future_base::_Result_base::_Deleter> (), std::__future_base::_Task_setter<std::unique_ptr<std::__future_base::_Result<void>, std::__future_base::_Result_base::_Deleter>, std::thread::_Invoker<std::tuple<void (move_group::ExecuteTaskSolutionCapability::*)(std::shared_ptr<rclcpp_action::ServerGoalHandle<moveit_task_constructor_msgs::action::ExecuteTaskSolution> > const&), move_group::ExecuteTaskSolutionCapability*, std::shared_ptr<rclcpp_action::ServerGoalHandle<moveit_task_constructor_msgs::action::ExecuteTaskSolution> > > >, void> >::_M_invoke(std::_Any_data const&)
[move_group-9] #2 Object "/home/user/ros2_ws/install/moveit_task_constructor_capabilities/lib/libmoveit_task_constructor_capabilities.so", at 0x7c4475e9b29e, in move_group::ExecuteTaskSolutionCapability::execCallback(std::shared_ptr<rclcpp_action::ServerGoalHandle<moveit_task_constructor_msgs::action::ExecuteTaskSolution> > const&)
[move_group-9] #1 Source "/usr/src/ros-jazzy-moveit-ros-planning-2.12.3-1noble.20250520.213359/plan_execution/src/plan_execution.cpp", line 475, in executeAndMonitor [0x7c44c26e603c]
[move_group-9] #0 | Source "/usr/src/ros-jazzy-moveit-core-2.12.3-1noble.20250520.202002/robot_state/src/robot_state.cpp", line 1226, in begin
[move_group-9] | Source "/usr/include/c++/13/bits/stl_map.h", line 378, in begin
[move_group-9] | 376: const_iterator
[move_group-9] | 377: begin() const _GLIBCXX_NOEXCEPT
[move_group-9] | > 378: { return _M_t.begin(); }
[move_group-9] | 379:
[move_group-9] | 380: /**
[move_group-9] Source "/usr/include/c++/13/bits/stl_tree.h", line 1002, in getAttachedBodies [0x7c44c23c474b]
[move_group-9] 1000: const_iterator
[move_group-9] 1001: begin() const _GLIBCXX_NOEXCEPT
[move_group-9] >1002: { return const_iterator(this->_M_impl._M_header._M_left); }
[move_group-9] 1003:
[move_group-9] 1004: iterator
[move_group-9] 1005: end() _GLIBCXX_NOEXCEPT
[move_group-9] Segmentation fault (Address not mapped to object [0xe8])
[ERROR] [move_group-9]: process has died [pid 55420, exit code -11, cmd '/opt/ros/jazzy/lib/moveit_ros_move_group/move_group --ros-args --params-file /tmp/launch_params_rhteziag --params-file /tmp/launch_params_ci1w8w2d --params-file /tmp/launch_params_qbdbnm6o --params-file /tmp/launch_params_sa30psmx --params-file /tmp/launch_params_yto5f730 --params-file /tmp/launch_params_bnsf3whj --params-file /tmp/launch_params_yiu6uurw --params-file /tmp/launch_params_bmphz8zv --params-file /tmp/launch_params_03dgi3qw --params-file /tmp/launch_params_7rc9lsxc --params-file /tmp/launch_params_hcn77_53'].