moveit_commander类的一些函数的说明
初始化moveit_commander,创建一个node
moveit_commander.roscpp_initialize(sys.argv)
rospy.init_node('move_group_python_interface_tutorial',
anonymous=True)
创建一个RobotCommander对象。RobotCommander是针对整个机器人的控制
robot = moveit_commander.RobotCommander
创建一个PlanningSceneInterface的对象。PlanningSceneInterface是用于和机器人环境的交互(如添加物体是会用到)
scene = moveit_commander.PlanningSceneInterface()
建MoveGroupCommander的对象。MoveGroupCommander是针对一个规划组进行控制。这里通过设置
group_name = panda_arm
控制Panda机器人的手臂。
group_name = panda_arm
group_name = "panda_arm"
group = moveit_commander.MoveGroupCommander(group_name)
创建一个Publisher,发布的类型是
DisplayTrajectory
,用于rivz显示
display_trajectory_publisher = rospy.Publisher('/move_group/display_planned_path', moveit_msgs.msg.DisplayTrajectory, queue_size=20)
Getting Basic Information
打印一些基本的信息
# We can get the name of the reference frame for this robot:
# 打印机器人参考系的名字
planning_frame = group.get_planning_frame()
print "============ Reference frame: %s" % planning_frame
# We can also print the name of the end-effector link for this group:
# 打印对应gripper组的末端执行器连杆的名字
eef_link = group.get_end_effector_link()
print "============ End effector: %s" % eef_link
# We can get a list of all the groups in the robot:
# 得到Robot中所有的规划组
group_names = robot.get_group_names()
print "============ Robot Groups:", robot.get_group_names()
# Sometimes for debugging it is useful to print the entire state of the
# robot:
# 得到机器人的当前状态(常用于debug)
print "============ Printing robot state"
print robot.get_current_state()
print ""
Planning to a Joint Goal
规划到一个关节目标
joint_positions=[-0.0867,-1.274,0.02832,0.0820,-1.273,-0.003]
group.set_joint_value_target(joint_positions)
group.go()
# We can get the joint values from the group and adjust some of the values:
joint_goal = group.get_current_joint_values()
joint_goal[0] = 0
joint_goal[1] = -pi/4
joint_goal[2] = 0
joint_goal[3] = -pi/2
joint_goal[4] = 0
joint_goal[5] = pi/3
joint_goal[6] = 0
# The go command can be called with joint values, poses, or without any
# parameters if you have already set the pose or joint target for the group
group.go(joint_goal, wait=True)
# Calling ``stop()`` ensures that there is no residual movement
group.stop()
Planning to a Pose Goal
定义一个姿态目标
pose_goal = geometry_msgs.msg.Pose()
pose_goal.orientation.w = 1.0
pose_goal.position.x = 0.4
pose_goal.position.y = 0.1
pose_goal.position.z = 0.4
group.set_pose_target(pose_goal)
规划并执行
plan = group.go(wait=True)
# Calling `stop()` ensures that there is no residual movement
group.stop()
# It is always good to clear your targets after planning with poses.
# Note: there is no equivalent function for clear_joint_value_targets()
group.clear_pose_targets()
Cartesian Paths
通过给一个指定的途经点
waypoints
的list来规划坐标系路径
cartesian path
waypoints = []
wpose = group.get_current_pose().pose
wpose.position.z -= scale * 0.1 # First move up (z)
wpose.position.y += scale * 0.2 # and sideways (y)
waypoints.append(copy.deepcopy(wpose))
wpose.position.x += scale * 0.1 # Second move forward/backwards in (x)
waypoints.append(copy.deepcopy(wpose))
wpose.position.y -= scale * 0.1 # Third move sideways (y)
waypoints.append(copy.deepcopy(wpose))
# We want the Cartesian path to be interpolated at a resolution of 1 cm
# which is why we will specify 0.01 as the eef_step in Cartesian
# translation. We will disable the jump threshold by setting it to 0.0 disabling:
(plan, fraction) = group.compute_cartesian_path(
waypoints, # waypoints to follow
0.01, # eef_step
0.0) # jump_threshold
# Note: We are just planning, not asking move_group to actually move the robot yet:
return plan, fraction
Displaying a Trajectory
在rviz中显示路径。调用group.plan()规划路径的时候回自动在rviz中显示。
也可以手动进行显示,创建一个
DisplayTrajectory
的消息对象,然后发布到’/move_group/display_planned_path’话题。
DisplayTrajectory消息主要有两个属性,起始点trajectory_start 和 路径trajectory。
display_trajectory = moveit_msgs.msg.DisplayTrajectory()
display_trajectory.trajectory_start = robot.get_current_state()
display_trajectory.trajectory.append(plan)
# Publish
display_trajectory_publisher.publish(display_trajectory);
Executing a Plan
执行计算出来的路径
group.execute(plan, wait=True)
Adding Objects to the Planning Scene
在场景中添加一个立方体, 设置位置在panda_leftfinger
box_pose = geometry_msgs.msg.PoseStamped()
box_pose.header.frame_id = "panda_leftfinger"
box_pose.pose.orientation.w = 1.0
box_name = "box"
scene.add_box(box_name, box_pose, size=(0.1, 0.1, 0.1))
Ensuring Collision Updates Are Receieved
在添加/移除物体后,会发布一个更新碰撞物体的消息,这个消息在发布出去的时候可能会丢失,为了确保物体成功添加/移除,可以通过get_known_object_names()获取当前已知的物体来检查是否成功。
start = rospy.get_time()
seconds = rospy.get_time()
while (seconds - start < timeout) and not rospy.is_shutdown():
# Test if the box is in attached objects
attached_objects = scene.get_attached_objects([box_name])
is_attached = len(attached_objects.keys()) > 0
# Test if the box is in the scene.
# Note that attaching the box will remove it from known_objects
is_known = box_name in scene.get_known_object_names()
# Test if we are in the expected state
if (box_is_attached == is_attached) and (box_is_known == is_known):
return True
# Sleep so that we give other threads time on the processor
rospy.sleep(0.1)
seconds = rospy.get_time()
# If we exited the while loop without returning then we timed out
return False
Attaching Objects to the Robot
绑定物体到机械臂。在用机械臂操纵物体的时候,为了防止MoveIt把某些link和物体的正常接触当做是碰撞而报,可以把这些link加入到
touch_links
,这样就会忽略这些link和物体的碰撞。
grasping_group = 'hand'
touch_links = robot.get_link_names(group=grasping_group)
scene.attach_box(eef_link, box_name, touch_links=touch_links)
Detaching Objects from the Robot
解绑
scene.remove_attached_object(eef_link, name=box_name)
Removing Objects from the Planning Scene
移除
scene.remove_world_object(box_name)
注意: 物体必须被解绑后才可以移除