Skip to content

Optional Numpy Compute Backend #3078

Optional Numpy Compute Backend

Optional Numpy Compute Backend #3078

GitHub Actions / Test Results succeeded Dec 12, 2024 in 0s

9 passed, 1 failed and 3 skipped

Tests failed

Report Passed Failed Skipped Time
12303021215-tests-test_controllers/test_controllers.xml 1✅ 736s
12303021215-tests-test_curobo/test_curobo.xml 1❌ 760s
12303021215-tests-test_multiple_envs/test_multiple_envs.xml 8✅ 2⚪ 504s
12303021215-tests-test_robot_teleoperation/test_robot_teleoperation.xml 1⚪ 31ms

✅ 12303021215-tests-test_controllers/test_controllers.xml

1 tests were completed in 736s with 1 passed, 0 failed and 0 skipped.

Test suite Passed Failed Skipped Time
pytest 1✅ 736s

✅ pytest

tests.test_controllers
  ✅ test_arm_control

❌ 12303021215-tests-test_curobo/test_curobo.xml

1 tests were completed in 760s with 0 passed, 1 failed and 0 skipped.

Test suite Passed Failed Skipped Time
pytest 1❌ 760s

❌ pytest

tests.test_curobo
  ❌ test_curobo
	def test_curobo():

✅ 12303021215-tests-test_multiple_envs/test_multiple_envs.xml

10 tests were completed in 504s with 8 passed, 0 failed and 2 skipped.

Test suite Passed Failed Skipped Time
pytest 8✅ 2⚪ 504s

✅ pytest

tests.test_multiple_envs
  ✅ test_multi_scene_dump_load_states
  ✅ test_multi_scene_get_local_position
  ✅ test_multi_scene_set_local_position
  ✅ test_multi_scene_scene_prim
  ✅ test_multi_scene_particle_source
  ✅ test_multi_scene_position_orientation_relative_to_scene
  ✅ test_tiago_getter
  ✅ test_tiago_setter
  ⚪ test_behavior_getter
  ⚪ test_behavior_setter

✅ 12303021215-tests-test_robot_teleoperation/test_robot_teleoperation.xml

1 tests were completed in 31ms with 0 passed, 0 failed and 1 skipped.

Test suite Passed Failed Skipped Time
pytest 1⚪ 31ms

✅ pytest

tests.test_robot_teleoperation
  ⚪ test_teleop

Annotations

Check failure on line 0 in 12303021215-tests-test_curobo/test_curobo.xml

See this annotation in the file changed.

@github-actions github-actions / Test Results

pytest ► tests.test_curobo ► test_curobo

Failed test found in:
  12303021215-tests-test_curobo/test_curobo.xml
Error:
  def test_curobo():
Raw output
def test_curobo():
        # Make sure object states are enabled
        assert gm.ENABLE_OBJECT_STATES
    
        # Create env
        cfg = {
            "env": {
                "action_frequency": 30,
                "physics_frequency": 300,
            },
            "scene": {
                "type": "Scene",
            },
            "objects": [
                {
                    "type": "PrimitiveObject",
                    "name": "obj0",
                    "primitive_type": "Cube",
                    "scale": [0.4, 0.4, 0.4],
                    "fixed_base": True,
                    "position": [0.5, -0.1, 0.2],
                    "orientation": [0, 0, 0, 1],
                },
                {
                    "type": "PrimitiveObject",
                    "name": "eef_marker_0",
                    "primitive_type": "Sphere",
                    "radius": 0.05,
                    "visual_only": True,
                    "position": [0, 0, 0],
                    "orientation": [0, 0, 0, 1],
                    "rgba": [1, 0, 0, 1],
                },
                {
                    "type": "PrimitiveObject",
                    "name": "eef_marker_1",
                    "primitive_type": "Sphere",
                    "radius": 0.05,
                    "visual_only": True,
                    "position": [0, 0, 0],
                    "orientation": [0, 0, 0, 1],
                    "rgba": [0, 1, 0, 1],
                },
            ],
            "robots": [],
        }
    
        robot_cfgs = [
            {
                "type": "FrankaPanda",
                "obs_modalities": "rgb",
                "position": [0.7, -0.55, 0.0],
                "orientation": [0, 0, 0.707, 0.707],
                "self_collisions": True,
                "action_normalize": False,
                "controller_config": {
                    "arm_0": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "gripper_0": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                },
            },
            {
                "type": "R1",
                "obs_modalities": "rgb",
                "position": [0.7, -0.7, 0.056],
                "orientation": [0, 0, 0.707, 0.707],
                "self_collisions": True,
                "action_normalize": False,
                "controller_config": {
                    "base": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "trunk": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "arm_left": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "arm_right": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "gripper_left": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "gripper_right": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                },
            },
            {
                "type": "Tiago",
                "obs_modalities": "rgb",
                "position": [0.7, -0.85, 0],
                "orientation": [0, 0, 0.707, 0.707],
                "self_collisions": True,
                "action_normalize": False,
                "controller_config": {
                    "base": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "trunk": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "camera": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "arm_left": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "arm_right": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "gripper_left": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                    "gripper_right": {
                        "name": "JointController",
                        "motor_type": "position",
                        "command_input_limits": None,
                        "use_delta_commands": False,
                        "use_impedances": True,
                    },
                },
            },
        ]
        for robot_cfg in robot_cfgs:
            cfg["robots"] = [robot_cfg]
    
            env = og.Environment(configs=cfg)
            robot = env.robots[0]
            obj = env.scene.object_registry("name", "obj0")
            eef_markers = [env.scene.object_registry("name", f"eef_marker_{i}") for i in range(2)]
    
            floor_touching_base_link_prim_paths = (
                [os.path.join(robot.prim_path, link_name) for link_name in robot.floor_touching_base_link_names]
                if isinstance(robot, LocomotionRobot)
                else []
            )
    
            robot.reset()
    
            # Open the gripper(s) to match cuRobo's default state
            for arm_name in robot.gripper_control_idx.keys():
                gripper_control_idx = robot.gripper_control_idx[arm_name]
                robot.set_joint_positions(th.ones_like(gripper_control_idx), indices=gripper_control_idx, normalized=True)
    
            robot.keep_still()
    
            for _ in range(5):
                og.sim.step()
    
            env.scene.update_initial_state()
            env.scene.reset()
    
            # Create CuRobo instance
            batch_size = 2
            n_samples = 20
    
            cmg = CuRoboMotionGenerator(
                robot=robot,
                batch_size=batch_size,
                debug=False,
                use_cuda_graph=True,
                use_default_embodiment_only=True,
            )
    
            # Sample values for robot
            th.manual_seed(1)
            lo, hi = robot.joint_lower_limits.clone().view(1, -1), robot.joint_upper_limits.clone().view(1, -1)
    
            if isinstance(robot, HolonomicBaseRobot):
                lo[0, :2] = -0.1
                lo[0, 2:5] = 0.0
                lo[0, 5] = -math.pi
                hi[0, :2] = 0.1
                hi[0, 2:5] = 0.0
                hi[0, 5] = math.pi
    
            random_qs = lo + th.rand((n_samples, robot.n_dof)) * (hi - lo)
    
            # Test collision with the environment (not including self-collisions)
            collision_results = cmg.check_collisions(q=random_qs)
    
            target_pos, target_quat = defaultdict(list), defaultdict(list)
    
            floor_plane_prim_paths = {child.GetPath().pathString for child in og.sim.floor_plane._prim.GetChildren()}
    
            # View results
            false_positive = 0
            false_negative = 0
    
            target_pos_in_world_frame = defaultdict(list)
            for i, (q, curobo_has_contact) in enumerate(zip(random_qs, collision_results)):
                # Set robot to desired qpos
                robot.set_joint_positions(q)
                robot.keep_still()
                og.sim.step_physics()
    
                # To debug
                # cmg.save_visualization(robot.get_joint_positions(), "/scr/chengshu/Downloads/test.obj")
    
                # Sanity check in the GUI that the robot pose makes sense
                for _ in range(10):
                    og.sim.render()
    
                # Validate that expected collision result is correct
                self_collision_pairs = set()
                floor_contact_pairs = set()
                wheel_contact_pairs = set()
                obj_contact_pairs = set()
    
                for contact in robot.contact_list():
                    assert contact.body0 in robot.link_prim_paths
                    if contact.body1 in robot.link_prim_paths:
                        self_collision_pairs.add((contact.body0, contact.body1))
                    elif contact.body1 in floor_plane_prim_paths:
                        if contact.body0 not in floor_touching_base_link_prim_paths:
                            floor_contact_pairs.add((contact.body0, contact.body1))
                        else:
                            wheel_contact_pairs.add((contact.body0, contact.body1))
                    elif contact.body1 in obj.link_prim_paths:
                        obj_contact_pairs.add((contact.body0, contact.body1))
                    else:
                        assert False, f"Unexpected contact pair: {contact.body0}, {contact.body1}"
    
                touching_itself = len(self_collision_pairs) > 0
                touching_floor = len(floor_contact_pairs) > 0
                touching_object = len(obj_contact_pairs) > 0
    
                curobo_has_contact = curobo_has_contact.item()
                physx_has_contact = touching_itself or touching_floor or touching_object
    
                # cuRobo reports contact, but physx reports no contact
                if curobo_has_contact and not physx_has_contact:
                    false_positive += 1
                    print(
                        f"False positive {i}: {curobo_has_contact} vs. {physx_has_contact} (touching_itself/obj/floor: {touching_itself}/{touching_object}/{touching_floor})"
                    )
    
                # physx reports contact, but cuRobo reports no contact
                elif not curobo_has_contact and physx_has_contact:
                    false_negative += 1
                    print(
                        f"False negative {i}: {curobo_has_contact} vs. {physx_has_contact} (touching_itself/obj/floor: {touching_itself}/{touching_object}/{touching_floor})"
                    )
    
                # neither cuRobo nor physx reports contact, valid planning goals
                elif not curobo_has_contact and not physx_has_contact:
                    for arm_name in robot.arm_names:
                        # For holonomic base robots, we need to be in the frame of @robot.root_link, not @robot.base_footprint_link
                        if isinstance(robot, HolonomicBaseRobot):
                            base_link_pose = robot.root_link.get_position_orientation()
                            eef_link_pose = robot.eef_links[arm_name].get_position_orientation()
                            eef_pos, eef_quat = T.relative_pose_transform(*eef_link_pose, *base_link_pose)
                        else:
                            eef_pos, eef_quat = robot.get_relative_eef_pose(arm_name)
    
                        target_pos[robot.eef_link_names[arm_name]].append(eef_pos)
                        target_quat[robot.eef_link_names[arm_name]].append(eef_quat)
    
                        target_pos_in_world_frame[robot.eef_link_names[arm_name]].append(robot.get_eef_position(arm_name))
    
            print(
                f"Collision checking false positive: {false_positive / n_samples}, false negative: {false_negative / n_samples}."
            )
            assert (
                false_positive / n_samples == 0.0
            ), f"Collision checking false positive rate: {false_positive / n_samples}, should be == 0.0."
            assert (
                false_negative / n_samples == 0.0
            ), f"Collision checking false negative rate: {false_negative / n_samples}, should be == 0.0."
    
            env.scene.reset()
    
            for arm_name in robot.arm_names:
                target_pos[robot.eef_link_names[arm_name]] = th.stack(target_pos[robot.eef_link_names[arm_name]], dim=0)
                target_quat[robot.eef_link_names[arm_name]] = th.stack(target_quat[robot.eef_link_names[arm_name]], dim=0)
                target_pos_in_world_frame[robot.eef_link_names[arm_name]] = th.stack(
                    target_pos_in_world_frame[robot.eef_link_names[arm_name]], dim=0
                )
    
            # Cast defaultdict to dict
            target_pos = dict(target_pos)
            target_quat = dict(target_quat)
            target_pos_in_world_frame = dict(target_pos_in_world_frame)
    
            print(f"Planning for {len(target_pos[robot.eef_link_names[robot.default_arm]])} eef targets...")
    
            # Generate collision-free trajectories to the sampled eef poses (including self-collisions)
            successes, traj_paths = cmg.compute_trajectories(
                target_pos=target_pos,
                target_quat=target_quat,
                is_local=True,
                max_attempts=1,
                timeout=60.0,
                ik_fail_return=5,
                enable_finetune_trajopt=True,
                finetune_attempts=1,
                return_full_result=False,
                success_ratio=1.0,
                attached_obj=None,
            )
    
            # Make sure collision-free trajectories are generated
            success_rate = successes.double().mean().item()
            print(f"Collision-free trajectory generation success rate: {success_rate}")
            assert success_rate == 1.0, f"Collision-free trajectory generation success rate: {success_rate}"
    
            # 1cm and 3 degrees error tolerance for prismatic and revolute joints, respectively
            error_tol = th.tensor(
                [0.01 if joint.joint_type == "PrismaticJoint" else 3.0 / 180.0 * math.pi for joint in robot.joints.values()]
            )
    
            # for bypass_physics in [True, False]:
            for bypass_physics in [True]:
                for traj_idx, (success, traj_path) in enumerate(zip(successes, traj_paths)):
                    if not success:
                        continue
    
                    # Reset the environment
                    env.scene.reset()
    
                    # Move the markers to the desired eef positions
                    for marker, arm_name in zip(eef_markers, robot.arm_names):
                        eef_link_name = robot.eef_link_names[arm_name]
                        marker.set_position_orientation(position=target_pos_in_world_frame[eef_link_name][traj_idx])
    
                    q_traj = cmg.path_to_joint_trajectory(traj_path)
                    # joint_positions_set_point = []
                    # joint_positions_response = []
                    for i, q in enumerate(q_traj):
                        if bypass_physics:
                            print(f"Teleporting waypoint {i}/{len(q_traj)}")
                            robot.set_joint_positions(q)
                            robot.keep_still()
                            og.sim.step()
                            for contact in robot.contact_list():
                                assert contact.body0 in robot.link_prim_paths
                                if (
                                    contact.body1 in floor_plane_prim_paths
                                    and contact.body0 in floor_touching_base_link_prim_paths
                                ):
                                    continue
                                if th.tensor(list(contact.impulse)).norm() == 0:
                                    continue
                                print(f"Unexpected contact pair during traj rollout: {contact.body0}, {contact.body1}")
>                               assert (
                                    False
                                ), f"Unexpected contact pair during traj rollout: {contact.body0}, {contact.body1}"
E                               AssertionError: Unexpected contact pair during traj rollout: /World/scene_0/controllable__r1__robot_yybcvt/left_arm_link6, /World/scene_0/controllable__r1__robot_yybcvt/left_arm_link1
E                               assert False

tests/test_curobo.py:422: AssertionError