コード例 #1
0
ファイル: primitives.py プロジェクト: nehap25/rlwithgp
def new_move(robot, traj, simulation):
    #set_conf(robot, traj[0])
    a=time.time()
    close_gripper(robot)
    b=time.time()
    for i in traj:
        
        robot.constrain(i)
        #print(STEPS)
        #start=time.time()
        step_simulation(steps=STEPS, simulate=False)
        #end=time.time()
        close_gripper(robot)
コード例 #2
0
ファイル: run.py プロジェクト: nehap25/rlwithgp
def execute_plan(plan, rrt_info):
    action_dict = {
        'move': move,
        'push': push,
    }
    table_aabb, obstacle_objects = rrt_info
    for action in plan:
        input(f'press enter to execute action: {action.name}')
        action_dict[action.name](*action.args,
                                 simulation=True,
                                 rrt_info=(table_aabb,
                                           get_obstacles(obstacle_objects)))
        step_simulation(steps=STEPS)
コード例 #3
0
ファイル: gen_data.py プロジェクト: nehap25/rlwithgp
def setup(use_gui):
    #TODO: get rid of random sampling
    n_obj = 0
    n_stack = 0
    connect_type = p.GUI if use_gui else p.DIRECT
    p.connect(connect_type)
    p.setAdditionalSearchPath(pybullet_data.getDataPath())
    p.setGravity(0., 0., -10.)

    plane, table, robot = init_world()
    table_aabb = np.array(p.getAABB(table)) - np.divide(
        ((-DIM, -DIM, 0), (DIM, DIM, 0)), 2)
    reject_aabbs = [get_full_aabb(robot)]

    objects, mass_bool = gen_objects(table_aabb, 1, reject_aabbs)
    push_obj = objects[0]
    region_wlh = (DIM, DIM, 0)
    region = rejection_sample_region(table_aabb, region_wlh,
                                     [p.getAABB(push_obj.pid)])

    #goal_pos = sample_aabb(np.array(region.aabb))
    push_vec = np.subtract((0.68, 0.3, 0.67), push_obj.pose.pos)
    yaw = get_yaw(push_vec)
    goal_ori = eul_to_quat((0, 0, yaw))
    goal_pose = Pose(((0.68, 0.3, 0.67), goal_ori))
    visual_id = p.createVisualShape(p.GEOM_BOX,
                                    halfExtents=[0.05, 0.05, 0.05],
                                    rgbaColor=(1, 0, 0, 0.75))
    goal_block_id = p.createMultiBody(
        baseVisualShapeIndex=visual_id,
        basePosition=list(goal_pose.pos),
    )

    start_pose = Pose((push_obj.pose.pos, goal_ori))

    from_conf = robot.conf

    set_pose(push_obj, start_pose)

    objects.extend(gen_stack(push_obj, n_stack))

    objects.extend(gen_objects(table_aabb, n_obj, reject_aabbs))
    step_simulation(steps=20)
    end_poses = [get_pose(obj) for obj in objects]
    full_pose = end_poses + [from_conf]
    return full_pose, robot, objects, use_gui, goal_pose, mass_bool
コード例 #4
0
ファイル: primitives.py プロジェクト: nehap25/rlwithgp
def move(robot, from_conf=None, to_conf=None, traj=None, simulation=False, rrt_info=None):
    assert (from_conf is not None and to_conf is not None) or traj is not None
    if traj is None:
        X_aabb, obstacles = rrt_info
        rrt_out = rrt(X_aabb[:, :2].T, from_conf.pos[:2], to_conf.pos[:2], obstacles)
        traj = rrt_to_traj(rrt_out, from_conf, to_conf)
    if from_conf is None: from_conf = traj[0]
    if simulation: assert_poses_close(get_conf(robot), from_conf)
    set_conf(robot, traj[0])
    close_gripper(robot)
    for i in range(len(traj)):
        robot.constrain(traj[i])
        step_simulation(steps=STEPS, simulate=simulation)
        close_gripper(robot)
        if not close_enough(traj[i].pos, get_conf(robot).pos): 
            return robot.conf, max(0, i - 5)
    return traj[-1], len(traj)
コード例 #5
0
ファイル: gen_data.py プロジェクト: nehap25/rlwithgp
def step(angle, push_distance, robot, objects, goal_pose, use_gui):
    a = time.time()
    step_simulation(steps=STEPS)
    b = time.time()
    #print(angle, push_distance)
    #action_list=action_list_normal(angle,push_distance,get_conf(robot))
    action_list = calc_action_list_v2(angle, push_distance, get_conf(robot))
    #print(angle, push_distance)
    c = time.time()
    simulate_push(robot, use_gui, action_list)
    d = time.time()
    del action_list
    step_simulation(steps=STEPS)
    end_poses = [get_pose(obj) for obj in objects] + [get_conf(robot)]
    e = time.time()
    reward = calc_reward(end_poses, goal_pose)
    f = time.time()
    #print(f-e,e-d,d-c,c-b,b-a,"STEP")
    empty_steps()
    return robot, objects, use_gui, reward
コード例 #6
0
ファイル: run.py プロジェクト: nehap25/rlwithgp
def solve_problem(seed=None, simulate=False):
    p.connect(p.DIRECT)
    np.random.seed(seed)
    np_state = np.random.get_state()
    problem = get_problem()
    pr = cProfile.Profile()
    pr.enable()
    solution = solve_incremental(problem, verbose=False)
    pr.disable()
    pstats.Stats(pr).sort_stats('tottime').print_stats(10)  # cumtime | tottime
    plan, cost, evaluations = solution
    print_solution(solution)
    p.disconnect()

    if simulate:
        p.connect(p.GUI)
        np.random.set_state(np_state)
        table_aabb, robot, region, objects, poses, init_extend = load_world()
        execute_plan(plan, (table_aabb, objects))
        step_simulation(steps=1000, simulate=True)
        p.disconnect()
コード例 #7
0
ファイル: run.py プロジェクト: nehap25/rlwithgp
def load_world():
    p.setAdditionalSearchPath(pybullet_data.getDataPath())
    p.setGravity(0., 0., -10.)

    plane = p.loadURDF('plane.URDF')
    table = p.loadURDF('table/table.URDF')

    table_aabb = np.array(p.getAABB(table))
    table_top = table_aabb[1][2]

    init_conf = Conf(((table_aabb[0][0], table_aabb[0][1],
                       table_top + GRIPPER_Z), GRIPPER_ORI))
    gripper = p.loadURDF('pr2_gripper.urdf',
                         basePosition=init_conf.pos,
                         baseOrientation=init_conf.ori)
    robot = Robot(gripper, init_conf)

    obj = create_object(color=(0., 0., 1., 1.))
    init_pose = Pose(((-.2, 0., table_top + DIM / 2.), ORI))
    set_pose(obj, init_pose)

    n_stack = 2
    stack_objects, init_extend = create_stack(n_stack,
                                              obj,
                                              color=(0., 0., 1., 1.))

    other_obj = create_object(color=(1., 0., 0., 1.))
    other_pose = Pose(((.2, 0., table_top + DIM / 2.), ORI))
    set_pose(other_obj, other_pose)

    step_simulation(steps=STEPS)
    conf = get_conf(robot)
    pose = get_pose(obj)
    for stack_obj in stack_objects:
        get_pose(stack_obj)
    other_pose = get_pose(other_obj)

    for stack_obj in stack_objects:
        rel_pose = Pose((tuple(np.subtract(stack_obj.pose.pos,
                                           obj.pose.pos)), (0., 0., 0., 0.)))
        init_extend.append(('RelPose', stack_obj, rel_pose, obj))
        init_extend.append(('AtRelPose', stack_obj, rel_pose, obj))
        init_extend.append(
            ('PoseKin', stack_obj, stack_obj.pose, rel_pose, obj, obj.pose))

    center = table_aabb[1][0] - DIM, 0., table_aabb[1][2]
    halves = np.array([DIM, DIM / 2., 0.])
    aabb = tuple(center - halves), tuple(center + halves)
    visual = p.createVisualShape(p.GEOM_BOX,
                                 halfExtents=halves,
                                 rgbaColor=(0., 1., 0., 1.))
    body = p.createMultiBody(baseVisualShapeIndex=visual, basePosition=center)
    region = Region(center, aabb)

    objects = [obj, other_obj]
    objects.extend(stack_objects)

    goal_pose = Pose(
        ((center[0] - DIM / 2., center[1], pose.pos[2]), pose.ori))
    other_alt_pose = Pose((tuple(np.add(other_pose.pos,
                                        (0., .2, 0.))), other_pose.ori))
    other_goal_pose = Pose(
        ((center[0] + DIM / 2., center[1], other_pose.pos[2]), other_pose.ori))
    poses = [
        [goal_pose],
        [other_alt_pose, other_goal_pose],
        [],
        [],
    ]

    return table_aabb, robot, region, objects, poses, init_extend
コード例 #8
0
ファイル: gen_data.py プロジェクト: nehap25/rlwithgp
def empty_steps():
    step_simulation(steps=20)