Hey,
I’m running Isaac Sim and Moveit in the same docker on AWS, I followed this tutorial for making the communication between them but I got this error and I don’t know how to fix it.
Please can someone help me?
[ INFO] [1636322044.476872816, 2770.458737763]: Loading robot model ‘panda’…
[ WARN] [1636322044.476985524, 2770.458737763]: Link panda_leftfinger has visual geometry but no collision geometry. Collision geometry will be left empty. Fix your URDF file by explicitly specifying collision geometry.
[ WARN] [1636322044.477015351, 2770.458737763]: Link panda_rightfinger has visual geometry but no collision geometry. Collision geometry will be left empty. Fix your URDF file by explicitly specifying collision geometry.
[ INFO] [1636322053.945177205, 2779.926480925]: Starting planning scene monitor
[ INFO] [1636322053.946956371, 2779.926480925]: Listening to ‘/move_group/monitored_planning_scene’
[ INFO] [1636322053.962372539, 2779.943207925]: No active joints or end effectors found for group ‘hand’. Make sure that kinematics.yaml is loaded in this node’s namespace.
[ INFO] [1636322053.962999789, 2779.943207925]: No active joints or end effectors found for group ‘hand’. Make sure that kinematics.yaml is loaded in this node’s namespace.
[ INFO] [1636322053.970249581, 2779.943207925]: Constructing new MoveGroup connection for group ‘hand’ in namespace ‘’
[ INFO] [1636322054.944442196, 2780.930092946]: Ready to take commands for planning group hand.
[ INFO] [1636322065.839571803, 2791.819731118]: Constructing new MoveGroup connection for group ‘panda_arm’ in namespace ‘’
[ INFO] [1636322065.858431871, 2791.836459119]: Ready to take commands for planning group panda_arm.
[ INFO] [1636322147.758169262, 2873.734975096]: Combined planning and execution request received for MoveGroup action. Forwarding to planning and execution pipeline.
[ INFO] [1636322147.758329891, 2873.734975096]: Planning attempt 1 of at most 1
[ INFO] [1636322147.758640039, 2873.734975096]: Found a contact between ‘panda_link5’ (type ‘Robot link’) and ‘panda_hand’ (type ‘Robot link’), which constitutes a collision. Contact information is not stored.
[ INFO] [1636322147.758668974, 2873.734975096]: Collision checking is considered complete (collision was found and 0 contacts are stored)
[ INFO] [1636322147.758699489, 2873.734975096]: Start state appears to be in collision with respect to group panda_arm
[ WARN] [1636322147.778724573, 2873.751702096]: Unable to find a valid state nearby the start state (using jiggle fraction of 0.050000 and 100 sampling attempts). Passing the original planning request to the planner.
[ INFO] [1636322147.779951341, 2873.751702096]: Planner configuration ‘panda_arm’ will use planner ‘geometric::RRTConnect’. Additional configuration parameters will be set when the planner is constructed.
[ WARN] [1636322147.780566147, 2873.751702096]: panda_arm/panda_arm: Skipping invalid start state (invalid state)
[ WARN] [1636322147.780621116, 2873.751702096]: panda_arm/panda_arm: Skipping invalid start state (invalid state)
[ WARN] [1636322147.780680531, 2873.751702096]: panda_arm/panda_arm: Skipping invalid start state (invalid state)
[ WARN] [1636322147.780738985, 2873.751702096]: panda_arm/panda_arm: Skipping invalid start state (invalid state)
[ERROR] [1636322147.780803614, 2873.751702096]: panda_arm/panda_arm: Motion planning start tree could not be initialized!
[ERROR] [1636322147.780848273, 2873.751702096]: panda_arm/panda_arm: Motion planning start tree could not be initialized!
[ERROR] [1636322147.780915035, 2873.751702096]: panda_arm/panda_arm: Motion planning start tree could not be initialized!
[ERROR] [1636322147.780966174, 2873.751702096]: panda_arm/panda_arm: Motion planning start tree could not be initialized!
[ WARN] [1636322147.781037485, 2873.751702096]: ParallelPlan::solve(): Unable to find solution by any of the threads in 0.000751 seconds
[ WARN] [1636322147.781183259, 2873.751702096]: panda_arm/panda_arm: Skipping invalid start state (invalid state)
[ERROR] [1636322147.781223551, 2873.751702096]: panda_arm/panda_arm: Motion planning start tree could not be initialized!
[ WARN] [1636322147.781258607, 2873.751702096]: panda_arm/panda_arm: Skipping invalid start state (invalid state)
[ERROR] [1636322147.781307756, 2873.751702096]: panda_arm/panda_arm: Motion planning start tree could not be initialized!
[ WARN] [1636322147.781390161, 2873.751702096]: panda_arm/panda_arm: Skipping invalid start state (invalid state)
[ WARN] [1636322147.781425168, 2873.751702096]: panda_arm/panda_arm: Skipping invalid start state (invalid state)
[ERROR] [1636322147.781460079, 2873.751702096]: panda_arm/panda_arm: Motion planning start tree could not be initialized!
[ERROR] [1636322147.781496587, 2873.751702096]: panda_arm/panda_arm: Motion planning start tree could not be initialized!
[ WARN] [1636322147.781533987, 2873.751702096]: ParallelPlan::solve(): Unable to find solution by any of the threads in 0.000407 seconds
[ WARN] [1636322147.781646084, 2873.751702096]: panda_arm/panda_arm: Skipping invalid start state (invalid state)
[ WARN] [1636322147.781697189, 2873.751702096]: panda_arm/panda_arm: Skipping invalid start state (invalid state)
[ERROR] [1636322147.781743120, 2873.751702096]: panda_arm/panda_arm: Motion planning start tree could not be initialized!
[ERROR] [1636322147.781784203, 2873.751702096]: panda_arm/panda_arm: Motion planning start tree could not be initialized!
[ WARN] [1636322147.781823542, 2873.751702096]: ParallelPlan::solve(): Unable to find solution by any of the threads in 0.000235 seconds
[ WARN] [1636322147.789653094, 2873.768433096]: Goal sampling thread never did any work.
[ INFO] [1636322147.789754522, 2873.768433096]: Unable to solve the planning problem
[ INFO] [1636322152.579504850, 2878.552427163]: ABORTED: No motion plan found. No execution attempted