You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
I wrote a python command file for control, but when executing it, I encountered an error. If you have ever encountered the same error then please help me or please show me how to write python code properly
Code:```
#! /usr/bin/env python
import sys
import copy
import rospy
import moveit_commander
import moveit_msgs.msg
import geometry_msgs.msg
moveit_commander.roscpp_initialize(sys.argv)
rospy.init_node('move_group_python_interface_tutorial', anonymous=True)
robot = moveit_commander.RobotCommander()
scene = moveit_commander.PlanningSceneInterface()
group = moveit_commander.MoveGroupCommander("arm")
display_trajectory_publisher = rospy.Publisher('/dsr01m0609/move_group/display_planned_path', moveit_msgs.msg.DisplayTrajectory, queue_size=1)
Error:
[ INFO] [1712510708.471945328, 83.837000000]: arm/arm: Starting planning with 1 states already in datastructure
[ERROR] [1712510713.477846782, 85.107000000]: arm/arm: Unable to sample any valid states for goal tree
[ INFO] [1712510713.477931216, 85.107000000]: arm/arm: Created 1 states (1 start + 0 goal)
[ INFO] [1712510713.477959780, 85.107000000]: No solution found after 5.006154 seconds
[ WARN] [1712510713.477982687, 85.107000000]: Timed out
[ INFO] [1712510713.495343471, 85.111000000]: Unable to solve the planning problem
The text was updated successfully, but these errors were encountered:
Our package does not inherently support MoveIt commands in Python. Unfortunately, it seems more beneficial to seek assistance from the MoveIt command-related community rather than addressing it as a our package issue.
I wrote a python command file for control, but when executing it, I encountered an error. If you have ever encountered the same error then please help me or please show me how to write python code properly
Code:```
#! /usr/bin/env python
import sys
import copy
import rospy
import moveit_commander
import moveit_msgs.msg
import geometry_msgs.msg
moveit_commander.roscpp_initialize(sys.argv)
rospy.init_node('move_group_python_interface_tutorial', anonymous=True)
robot = moveit_commander.RobotCommander()
scene = moveit_commander.PlanningSceneInterface()
group = moveit_commander.MoveGroupCommander("arm")
display_trajectory_publisher = rospy.Publisher('/dsr01m0609/move_group/display_planned_path', moveit_msgs.msg.DisplayTrajectory, queue_size=1)
pose_target = geometry_msgs.msg.Pose()
pose_target.orientation.w = 1e-6
pose_target.position.x = 0.96e-6
pose_target.position.y = 0e-6
pose_target.position.z = 1.18e-6
group.set_pose_target(pose_target)
plan1 = group.plan()
rospy.sleep(5)
moveit_commander.roscpp_shutdown()
The text was updated successfully, but these errors were encountered: