Exemple #1
0
UR3 = RRN.ConnectService('rr+tcp://localhost:55557?service=robot')
UR4 = RRN.ConnectService('rr+tcp://localhost:55558?service=robot')
UR = [UR1, UR2, UR3, UR4]
ABB1 = RRN.ConnectService('rr+tcp://localhost:11111?service=robot')
ABB2 = RRN.ConnectService('rr+tcp://localhost:11112?service=robot')
ABB3 = RRN.ConnectService('rr+tcp://localhost:11113?service=robot')
ABB4 = RRN.ConnectService('rr+tcp://localhost:11114?service=robot')
ABB = [ABB1, ABB2, ABB3, ABB4]

robot_const = RRN.GetConstants("com.robotraconteur.robotics.robot", UR1)
halt_mode = robot_const["RobotCommandMode"]["halt"]
jog_mode = robot_const["RobotCommandMode"]["jog"]

for i in range(4):
    try:

        UR[i].command_mode = halt_mode
        time.sleep(0.1)
        UR[i].command_mode = jog_mode
        ABB[i].command_mode = halt_mode
        time.sleep(0.1)
        ABB[i].command_mode = jog_mode
        from ur_ik import inv
        p = inv([0.0, 0.3, 0.1]).reshape((6, 1))
        UR[i].jog_joint(p, np.ones((6, )), False, False)
        from abb_ik import inv
        p = inv([0.3, 0.0, 0.3]).reshape((6, 1))
        ABB[i].jog_joint(p, np.ones((6, )), False, False)
    except:
        traceback.print_exc()
Exemple #2
0
	
#connect to wires
detection_wire=cognex_inst.detection_wire.Connect()
robot_state = robot.robot_state.Connect()

##############robot param setup
robot_const = RRN.GetConstants("com.robotraconteur.robotics.robot", robot)
halt_mode = robot_const["RobotCommandMode"]["halt"]
jog_mode = robot_const["RobotCommandMode"]["jog"]
robot.command_mode = halt_mode
time.sleep(0.1)
robot.command_mode = jog_mode
n= len(robot.robot_info.joint_info)

#######move to start point
robot.jog_joint(inv([0.35,-0.3,0.3]).reshape((n,1)), np.ones((n,)), False, True)
print("moving to start point")

#initialize coordinate list
robot_eef_coordinates=[[robot_state.InValue.kin_chain_tcp['position']['x'][0],robot_state.InValue.kin_chain_tcp['position']['y'][0]]]
cam_coordinates=[[detection_wire.InValue[key].x,detection_wire.InValue[key].y]]


###
now=time.time()
while time.time()-now<5:
	joints=inv([0.25+np.sin(time.time()-now)/8.,-0.3+(time.time()-now)/8,0.3])
	robot.jog_joint(joints.reshape((n,1)), np.ones((n,)), False, True)
	robot_eef_coordinates.append([robot_state.InValue.kin_chain_tcp['position']['x'][0],robot_state.InValue.kin_chain_tcp['position']['y'][0]])
	cam_coordinates.append([detection_wire.InValue[key].x,detection_wire.InValue[key].y])
	
Exemple #3
0
cmd_w = robot.position_command.Connect()

##############robot param setup
robot_const = RRN.GetConstants("com.robotraconteur.robotics.robot", robot)
halt_mode = robot_const["RobotCommandMode"]["halt"]
jog_mode = robot_const["RobotCommandMode"]["jog"]
position_mode = robot_const["RobotCommandMode"]["position_command"]

robot.command_mode = halt_mode
time.sleep(0.1)
robot.command_mode = jog_mode
n = len(robot.robot_info.joint_info)

#######move to start point
robot.jog_joint(
    inv([0.35, -0.3, 0.3]).reshape((n, 1)), np.ones((n, )), False, True)
print("moving to start point")

#initialize coordinate list
robot_eef_coordinates = [[
    float(robot_state.InValue.kin_chain_tcp['position']['x'][0]),
    float(robot_state.InValue.kin_chain_tcp['position']['y'][0])
]]
cam_coordinates = [[
    detection_wire.InValue[key].x, detection_wire.InValue[key].y
]]

robot.command_mode = halt_mode
robot.command_mode = position_mode

vel_ctrl = EmulatedVelocityControl(robot, robot_state, cmd_w, 0.01)
Exemple #4
0
#connect to wires
detection_wire = cognex_inst.detection_wire.Connect()
robot_state = robot.robot_state.Connect()

##############robot param setup
robot_const = RRN.GetConstants("com.robotraconteur.robotics.robot", robot)
halt_mode = robot_const["RobotCommandMode"]["halt"]
jog_mode = robot_const["RobotCommandMode"]["jog"]
robot.command_mode = halt_mode
time.sleep(0.1)
robot.command_mode = jog_mode
n = len(robot.robot_info.joint_info)

#######move to start point
print("moving to start point")
start_joints = inv(start, R).reshape((n, 1))
robot.jog_joint(start_joints, np.ones((n, )), False, True)

#initialize coordinate list
robot_eef_coordinates = [[
    robot_state.InValue.kin_chain_tcp['position']['x'][0],
    robot_state.InValue.kin_chain_tcp['position']['y'][0]
]]
cam_coordinates = [[
    detection_wire.InValue[key].x, detection_wire.InValue[key].y
]]

###
now = time.time()
while time.time() - now < 5:
    # joints=inv([(start[0]+np.sin(time.time()-now)*factor),(start[1]+(time.time()-now)*0.1),start[2]],R)
Exemple #5
0
def plan(robot,
         pd,
         angle,
         vel_ctrl,
         distance_inst,
         vacuum2,
         robot_idx,
         obj_vel=[0, 0, 0],
         capture_time=0):  #start and end configuration in joint space
    distance_threshold = 0.12
    joint_threshold = 0.3
    transformations = distance_inst.transformations
    H_robot = transformations[robot_idx].H.reshape(
        (transformations[robot_idx].row, transformations[robot_idx].column))

    #parameter setup
    n = len(robot.robot_info.joint_info)
    P = np.transpose(np.array(robot.robot_info.chains[0].P.tolist()))
    H = np.transpose(np.array(robot.robot_info.chains[0].H.tolist()))
    joint_type = np.zeros(n)
    robot_def = Robot(H, P, joint_type)

    Rd = np.array([[-np.cos(angle), 0, np.sin(angle)],
                   [-np.sin(angle), 0, -np.cos(angle)], [0, -1, 0]])
    #calc desired joint angles
    q_des = inv(angle, pd).reshape(n)

    #enable velocity mode
    vel_ctrl.enable_velocity_mode()

    w = 10000  #set the weight between orientation and position
    Kq = .01 * np.eye(n)  #small value to make sure positive definite
    Kp = np.eye(3)
    KR = np.eye(3)  #gains for position and orientation error
    steps = 20  #number of steps to take to get to desired destination

    EP = [1, 1, 1]
    q_cur = np.zeros(n)

    while (norm(q_des - q_cur) > joint_threshold):
        if norm(obj_vel) != 0:
            p_d = (pd + obj_vel * (time.time() - capture_time))
            q_des = inv(angle, p_d).reshape(n)
        else:
            p_d = pd

        #cur joint angle
        q_cur = vel_ctrl.joint_position()

        #     get current H and J
        robot_pose = robot.robot_state.PeekInValue()[0].kin_chain_tcp[0]
        R_cur = q2R(np.array(robot_pose['orientation'].tolist()))
        p_cur = np.array(robot_pose['position'].tolist())
        J = robotjacobian(robot_def, q_cur)  #calculate current Jacobian
        Jp = J[3:, :]
        JR = J[:3, :]  #decompose to position and orientation Jacobian

        ER = np.dot(R_cur, np.transpose(Rd))
        EP = p_cur - p_d  #error in position and orientation

        try:
            distance_report = distance_inst.distance_check(robot_idx)
        except:
            traceback.print_exc()
            print("connection to distance checking service lost")

        Closest_Pt = distance_report.Closest_Pt
        Closest_Pt_env = distance_report.Closest_Pt_env
        dist = distance_report.min_distance
        J2C = distance_report.J2C

        if (Closest_Pt[0] != 0. and dist < distance_threshold):

            print("qp triggering ", dist)
            Closest_Pt[:2] = np.dot(H_robot, np.append(Closest_Pt[:2], 1))[:2]
            Closest_Pt_env[:2] = np.dot(H_robot,
                                        np.append(Closest_Pt_env[:2], 1))[:2]

            k, theta = R2rot(ER)  #decompose ER to (k,theta) pair

            #   set up s for different norm for ER

            s = np.sin(theta / 2) * k  #eR2
            vd = -np.dot(Kp, EP)
            wd = -np.dot(KR, s)
            H = np.dot(np.transpose(Jp),
                       Jp) + Kq  #+w*np.dot(np.transpose(JR),JR)
            H = (H + np.transpose(H)) / 2

            f = -np.dot(
                np.transpose(Jp), vd
            )  #-w*np.dot(np.transpose(JR),wd)               #setup quadprog parameters

            dx = Closest_Pt_env[0] - Closest_Pt[0]
            dy = Closest_Pt_env[1] - Closest_Pt[1]
            dz = Closest_Pt_env[2] - Closest_Pt[2]

            # derivative of dist w.r.t time
            der = np.array([dx / dist, dy / dist, dz / dist])
            J_Collision = np.hstack((J[3:, :J2C], np.zeros((3, n - J2C))))

            A = np.dot(der.reshape((1, 3)), J_Collision)

            b = np.array([0.])

            try:
                qdot = normalize_dq(solve_qp(H, f, A, b))

            except:
                traceback.print_exc()

        else:
            if norm(q_des - q_cur) < .5:
                qdot = normalize_dq(q_des - q_cur)
            else:
                qdot = 3. * normalize_dq(q_des - q_cur)

        vel_ctrl.set_velocity_command(qdot)

    vel_ctrl.set_velocity_command(np.zeros((n, )))
    vel_ctrl.disable_velocity_mode()
    return