Python pybullet.resetSimulation() Examples
The following are 21
code examples of pybullet.resetSimulation().
You can vote up the ones you like or vote down the ones you don't like,
and go to the original project or source file by following the links above each example.
You may also want to check out all available functions/classes of the module
pybullet
, or try the search function
.
Example #1
Source File: kukaGymEnv.py From soccer-matlab with BSD 2-Clause "Simplified" License | 6 votes |
def _reset(self): #print("KukaGymEnv _reset") self.terminated = 0 p.resetSimulation() p.setPhysicsEngineParameter(numSolverIterations=150) p.setTimeStep(self._timeStep) p.loadURDF(os.path.join(self._urdfRoot,"plane.urdf"),[0,0,-1]) p.loadURDF(os.path.join(self._urdfRoot,"table/table.urdf"), 0.5000000,0.00000,-.820000,0.000000,0.000000,0.0,1.0) xpos = 0.55 +0.12*random.random() ypos = 0 +0.2*random.random() ang = 3.14*0.5+3.1415925438*random.random() orn = p.getQuaternionFromEuler([0,0,ang]) self.blockUid =p.loadURDF(os.path.join(self._urdfRoot,"block.urdf"), xpos,ypos,-0.15,orn[0],orn[1],orn[2],orn[3]) p.setGravity(0,0,-10) self._kuka = kuka.Kuka(urdfRootPath=self._urdfRoot, timeStep=self._timeStep) self._envStepCounter = 0 p.stepSimulation() self._observation = self.getExtendedObservation() return np.array(self._observation)
Example #2
Source File: kukaCamGymEnv.py From soccer-matlab with BSD 2-Clause "Simplified" License | 6 votes |
def _reset(self): self.terminated = 0 p.resetSimulation() p.setPhysicsEngineParameter(numSolverIterations=150) p.setTimeStep(self._timeStep) p.loadURDF(os.path.join(self._urdfRoot,"plane.urdf"),[0,0,-1]) p.loadURDF(os.path.join(self._urdfRoot,"table/table.urdf"), 0.5000000,0.00000,-.820000,0.000000,0.000000,0.0,1.0) xpos = 0.5 +0.2*random.random() ypos = 0 +0.25*random.random() ang = 3.1415925438*random.random() orn = p.getQuaternionFromEuler([0,0,ang]) self.blockUid =p.loadURDF(os.path.join(self._urdfRoot,"block.urdf"), xpos,ypos,-0.1,orn[0],orn[1],orn[2],orn[3]) p.setGravity(0,0,-10) self._kuka = kuka.Kuka(urdfRootPath=self._urdfRoot, timeStep=self._timeStep) self._envStepCounter = 0 p.stepSimulation() self._observation = self.getExtendedObservation() return np.array(self._observation)
Example #3
Source File: balancebot_env.py From balance-bot with MIT License | 6 votes |
def _reset(self): # reset is called once at initialization of simulation self.vt = 0 self.vd = 0 self.maxV = 24.6 # 235RPM = 24,609142453 rad/sec self._envStepCounter = 0 p.resetSimulation() p.setGravity(0,0,-10) # m/s^2 p.setTimeStep(0.01) # sec planeId = p.loadURDF("plane.urdf") cubeStartPos = [0,0,0.001] cubeStartOrientation = p.getQuaternionFromEuler([0,0,0]) path = os.path.abspath(os.path.dirname(__file__)) self.botId = p.loadURDF(os.path.join(path, "balancebot_simple.xml"), cubeStartPos, cubeStartOrientation) # you *have* to compute and return the observation from reset() self._observation = self._compute_observation() return np.array(self._observation)
Example #4
Source File: sawyer_ik_controller.py From robosuite with MIT License | 6 votes |
def setup_inverse_kinematics(self): """ This function is responsible for doing any setup for inverse kinematics. Inverse Kinematics maps end effector (EEF) poses to joint angles that are necessary to achieve those poses. """ # Set up a connection to the PyBullet simulator. p.connect(p.DIRECT) p.resetSimulation() # get paths to urdfs self.robot_urdf = pjoin( self.bullet_data_path, "sawyer_description/urdf/sawyer_arm.urdf" ) # load the urdfs self.ik_robot = p.loadURDF(self.robot_urdf, (0, 0, 0.9), useFixedBase=1) # Simulation will update as fast as it can in real time, instead of waiting for # step commands like in the non-realtime case. p.setRealTimeSimulation(1)
Example #5
Source File: panda_ik_controller.py From robosuite with MIT License | 6 votes |
def setup_inverse_kinematics(self): """ This function is responsible for doing any setup for inverse kinematics. Inverse Kinematics maps end effector (EEF) poses to joint angles that are necessary to achieve those poses. """ # Set up a connection to the PyBullet simulator. p.connect(p.DIRECT) p.resetSimulation() # get paths to urdfs self.robot_urdf = pjoin( self.bullet_data_path, "panda_description/urdf/panda_arm.urdf" ) # load the urdfs self.ik_robot = p.loadURDF(self.robot_urdf, (0, 0, 0.9), useFixedBase=1) # Simulation will update as fast as it can in real time, instead of waiting for # step commands like in the non-realtime case. p.setRealTimeSimulation(1)
Example #6
Source File: pose_env.py From tensor2robot with Apache License 2.0 | 6 votes |
def _setup(self): """Sets up the robot + tray + objects. """ pybullet.resetSimulation(physicsClientId=self.cid) pybullet.setPhysicsEngineParameter(numSolverIterations=150, physicsClientId=self.cid) # pybullet.setTimeStep(self._time_step, physicsClientId=self.cid) pybullet.setGravity(0, 0, -10, physicsClientId=self.cid) plane_path = os.path.join(self._urdf_root, 'plane.urdf') pybullet.loadURDF(plane_path, [0, 0, -1], physicsClientId=self.cid) table_path = os.path.join(self._urdf_root, 'table/table.urdf') pybullet.loadURDF(table_path, [0.0, 0.0, -.65], [0., 0., 0., 1.], physicsClientId=self.cid) # Load the target object duck_path = os.path.join(self._urdf_root, 'duck_vhacd.urdf') pos = [0]*3 orn = [0., 0., 0., 1.] self._target_uid = pybullet.loadURDF( duck_path, pos, orn, physicsClientId=self.cid)
Example #7
Source File: bullet_world.py From NTP-vat-release with MIT License | 5 votes |
def restart(self): """Restart the simulation""" # Reset p.resetSimulation() self.load() self.start()
Example #8
Source File: panda_reach_gym_env.py From pybullet-robot-envs with GNU Lesser General Public License v2.1 | 5 votes |
def reset_simulation(self): self.terminated = 0 # --- reset simulation --- # p.resetSimulation(physicsClientId=self._physics_client_id) p.setPhysicsEngineParameter(numSolverIterations=150, physicsClientId=self._physics_client_id) p.setTimeStep(self._timeStep, physicsClientId=self._physics_client_id) self._env_step_counter = 0 p.setGravity(0, 0, -9.8, physicsClientId=self._physics_client_id) # --- reset robot --- # self._robot.reset() # Let the world run for a bit for _ in range(100): p.stepSimulation(physicsClientId=self._physics_client_id) # --- reset world --- # self._world.reset() # Let the world run for a bit for _ in range(100): p.stepSimulation(physicsClientId=self._physics_client_id) if self._use_IK: self._hand_pose = self._robot._home_hand_pose # --- draw some reference frames in the simulation for debugging --- # self._robot.debug_gui() self._world.debug_gui() p.stepSimulation(physicsClientId=self._physics_client_id)
Example #9
Source File: panda_push_gym_env.py From pybullet-robot-envs with GNU Lesser General Public License v2.1 | 5 votes |
def reset_simulation(self): self.terminated = 0 # --- reset simulation --- # p.resetSimulation(physicsClientId=self._physics_client_id) p.setPhysicsEngineParameter(numSolverIterations=150, physicsClientId=self._physics_client_id) p.setTimeStep(self._timeStep, physicsClientId=self._physics_client_id) self._env_step_counter = 0 p.setGravity(0, 0, -9.8, physicsClientId=self._physics_client_id) # --- reset robot --- # self._robot.reset() # Let the world run for a bit for _ in range(100): p.stepSimulation(physicsClientId=self._physics_client_id) # --- reset world --- # self._world.reset() # Let the world run for a bit for _ in range(100): p.stepSimulation(physicsClientId=self._physics_client_id) if self._use_IK: self._hand_pose = self._robot._home_hand_pose # --- draw some reference frames in the simulation for debugging --- # self._robot.debug_gui() self._world.debug_gui() p.stepSimulation(physicsClientId=self._physics_client_id)
Example #10
Source File: icub_push_gym_env.py From pybullet-robot-envs with GNU Lesser General Public License v2.1 | 5 votes |
def reset_simulation(self): self.terminated = 0 # --- reset simulation --- # p.resetSimulation(physicsClientId=self._physics_client_id) p.setPhysicsEngineParameter(numSolverIterations=150, physicsClientId=self._physics_client_id) p.setTimeStep(self._time_step, physicsClientId=self._physics_client_id) self._env_step_counter = 0 p.setGravity(0, 0, -9.8, physicsClientId=self._physics_client_id) # --- reset robot --- # self._robot.reset() # Let the world run for a bit for _ in range(100): p.stepSimulation(physicsClientId=self._physics_client_id) # --- reset world --- # self._world.reset() # Let the world run for a bit for _ in range(100): p.stepSimulation(physicsClientId=self._physics_client_id) if self._use_IK: self._hand_pose = self._robot._home_hand_pose # --- draw some reference frames in the simulation for debugging --- # self._robot.debug_gui() self._world.debug_gui() p.stepSimulation(physicsClientId=self._physics_client_id)
Example #11
Source File: icub_reach_gym_env.py From pybullet-robot-envs with GNU Lesser General Public License v2.1 | 5 votes |
def reset_simulation(self): self.terminated = 0 # --- reset simulation --- # p.resetSimulation(physicsClientId=self._physics_client_id) p.setPhysicsEngineParameter(numSolverIterations=150, physicsClientId=self._physics_client_id) p.setTimeStep(self._time_step, physicsClientId=self._physics_client_id) self._env_step_counter = 0 p.setGravity(0, 0, -9.8, physicsClientId=self._physics_client_id) # --- reset robot --- # self._robot.reset() # Let the world run for a bit for _ in range(100): p.stepSimulation(physicsClientId=self._physics_client_id) # --- reset world --- # self._world.reset() # Let the world run for a bit for _ in range(100): p.stepSimulation(physicsClientId=self._physics_client_id) # --- draw some reference frames in the simulation for debugging --- # self._robot.debug_gui() self._world.debug_gui() p.stepSimulation(physicsClientId=self._physics_client_id)
Example #12
Source File: simulation_manager.py From qibullet with Apache License 2.0 | 5 votes |
def resetSimulation(self, physics_client): """ Resets the simulated instance corresponding to the physics client id. All of the objects loaded in the simulation will be destroyed, but the instance will still be running """ self._clearInstance(physics_client) pybullet.resetSimulation(physicsClientId=physics_client)
Example #13
Source File: scene_abstract.py From bullet-gym with MIT License | 5 votes |
def clean_everything(self): p.resetSimulation() p.setGravity(0, 0, -self.gravity) p.setPhysicsEngineParameter(fixedTimeStep=self.timestep, numSolverIterations=5, numSubSteps=2)
Example #14
Source File: scene_abstract.py From midlevel-reps with MIT License | 5 votes |
def clean_everything(self): #p.resetSimulation() p.setGravity(0, 0, -self.gravity) #p.setDefaultContactERP(0.9) p.setPhysicsEngineParameter(fixedTimeStep=self.timestep*self.frame_skip, numSolverIterations=50, numSubSteps=(self.frame_skip-1))
Example #15
Source File: client.py From costar_plan with Apache License 2.0 | 5 votes |
def reset(self): ''' Reset the robot and task ''' if not self.fast_reset: pb.resetSimulation() self.task.clear() self.task.setup() self.task.reset() self.task.world.reset() # tick for a half second to make sure the world makes sense action = self.task.world.zeroAction() for _ in range(5): self.task.world.tick(action)
Example #16
Source File: baxter_ik_controller.py From robosuite with MIT License | 5 votes |
def setup_inverse_kinematics(self, urdf_path): """ This function is responsible for doing any setup for inverse kinematics. Inverse Kinematics maps end effector (EEF) poses to joint angles that are necessary to achieve those poses. """ # These indices come from the urdf file we're using self.effector_right = 27 self.effector_left = 45 # Use PyBullet to handle inverse kinematics. # Set up a connection to the PyBullet simulator. p.connect(p.DIRECT) p.resetSimulation() self.ik_robot = p.loadURDF(urdf_path, (0, 0, 0), useFixedBase=1) # Relevant joints we care about. Many of the joints are fixed and don't count, so # we need this second map to use the right ones. self.actual = [13, 14, 15, 16, 17, 19, 20, 31, 32, 33, 34, 35, 37, 38] self.num_joints = p.getNumJoints(self.ik_robot) n = p.getNumJoints(self.ik_robot) self.rest = [] self.lower = [] self.upper = [] self.ranges = [] for i in range(n): info = p.getJointInfo(self.ik_robot, i) # Retrieve lower and upper ranges for each relevant joint if info[3] > -1: self.rest.append(p.getJointState(self.ik_robot, i)[0]) self.lower.append(info[8]) self.upper.append(info[9]) self.ranges.append(info[9] - info[8]) # Simulation will update as fast as it can in real time, instead of waiting for # step commands like in the non-realtime case. p.setRealTimeSimulation(1)
Example #17
Source File: kuka_diverse_object_gym_env.py From soccer-matlab with BSD 2-Clause "Simplified" License | 5 votes |
def _reset(self): """Environment reset called at the beginning of an episode. """ # Set the camera settings. look = [0.23, 0.2, 0.54] distance = 1. pitch = -56 + self._cameraRandom*np.random.uniform(-3, 3) yaw = 245 + self._cameraRandom*np.random.uniform(-3, 3) roll = 0 self._view_matrix = p.computeViewMatrixFromYawPitchRoll( look, distance, yaw, pitch, roll, 2) fov = 20. + self._cameraRandom*np.random.uniform(-2, 2) aspect = self._width / self._height near = 0.01 far = 10 self._proj_matrix = p.computeProjectionMatrixFOV( fov, aspect, near, far) self._attempted_grasp = False self._env_step = 0 self.terminated = 0 p.resetSimulation() p.setPhysicsEngineParameter(numSolverIterations=150) p.setTimeStep(self._timeStep) p.loadURDF(os.path.join(self._urdfRoot,"plane.urdf"),[0,0,-1]) p.loadURDF(os.path.join(self._urdfRoot,"table/table.urdf"), 0.5000000,0.00000,-.820000,0.000000,0.000000,0.0,1.0) p.setGravity(0,0,-10) self._kuka = kuka.Kuka(urdfRootPath=self._urdfRoot, timeStep=self._timeStep) self._envStepCounter = 0 p.stepSimulation() # Choose the objects in the bin. urdfList = self._get_random_object( self._numObjects, self._isTest) self._objectUids = self._randomly_place_objects(urdfList) self._observation = self._get_observation() return np.array(self._observation)
Example #18
Source File: saveRestoreStateTest.py From soccer-matlab with BSD 2-Clause "Simplified" License | 5 votes |
def setupWorld(self): numObjects = 50 maximalCoordinates = False p.resetSimulation() p.setPhysicsEngineParameter(deterministicOverlappingPairs=1) p.loadURDF("planeMesh.urdf",useMaximalCoordinates=maximalCoordinates) kukaId = p.loadURDF("kuka_iiwa/model_free_base.urdf",[0,0,10], useMaximalCoordinates=maximalCoordinates) for i in range (p.getNumJoints(kukaId)): p.setJointMotorControl2(kukaId,i,p.POSITION_CONTROL,force=0) for i in range (numObjects): cube = p.loadURDF("cube_small.urdf",[0,i*0.02,(i+1)*0.2]) #p.changeDynamics(cube,-1,mass=100) p.stepSimulation() p.setGravity(0,0,-10)
Example #19
Source File: minitaur_evaluate.py From soccer-matlab with BSD 2-Clause "Simplified" License | 5 votes |
def evaluate_params(evaluateFunc, params, objectiveParams, urdfRoot='', timeStep=0.01, maxNumSteps=10000, sleepTime=0): print('start evaluation') beforeTime = time.time() p.resetSimulation() p.setTimeStep(timeStep) p.loadURDF("%s/plane.urdf" % urdfRoot) p.setGravity(0,0,-10) global minitaur minitaur = Minitaur(urdfRoot) start_position = current_position() last_position = None # for tracing line total_energy = 0 for i in range(maxNumSteps): torques = minitaur.getMotorTorques() velocities = minitaur.getMotorVelocities() total_energy += np.dot(np.fabs(torques), np.fabs(velocities)) * timeStep joint_values = evaluate_func_map[evaluateFunc](i, params) minitaur.applyAction(joint_values) p.stepSimulation() if (is_fallen()): break if i % 100 == 0: sys.stdout.write('.') sys.stdout.flush() time.sleep(sleepTime) print(' ') alpha = objectiveParams[0] final_distance = np.linalg.norm(start_position - current_position()) finalReturn = final_distance - alpha * total_energy elapsedTime = time.time() - beforeTime print ("trial for ", params, " final_distance", final_distance, "total_energy", total_energy, "finalReturn", finalReturn, "elapsed_time", elapsedTime) return finalReturn
Example #20
Source File: saveRestoreState.py From soccer-matlab with BSD 2-Clause "Simplified" License | 4 votes |
def setupWorld(): p.resetSimulation() p.setPhysicsEngineParameter(deterministicOverlappingPairs=1) p.loadURDF("planeMesh.urdf") kukaId = p.loadURDF("kuka_iiwa/model_free_base.urdf",[0,0,10]) for i in range (p.getNumJoints(kukaId)): p.setJointMotorControl2(kukaId,i,p.POSITION_CONTROL,force=0) for i in range (numObjects): cube = p.loadURDF("cube_small.urdf",[0,i*0.02,(i+1)*0.2]) #p.changeDynamics(cube,-1,mass=100) p.stepSimulation() p.setGravity(0,0,-10)
Example #21
Source File: unittests.py From soccer-matlab with BSD 2-Clause "Simplified" License | 4 votes |
def testJacobian(self): import pybullet as p clid = p.connect(p.SHARED_MEMORY) if (clid<0): p.connect(p.DIRECT) time_step = 0.001 gravity_constant = -9.81 urdfs = ["TwoJointRobot_w_fixedJoints.urdf", "TwoJointRobot_w_fixedJoints.urdf", "kuka_iiwa/model.urdf", "kuka_lwr/kuka.urdf"] for urdf in urdfs: p.resetSimulation() p.setTimeStep(time_step) p.setGravity(0.0, 0.0, gravity_constant) robotId = p.loadURDF(urdf, useFixedBase=True) p.resetBasePositionAndOrientation(robotId,[0,0,0],[0,0,0,1]) numJoints = p.getNumJoints(robotId) endEffectorIndex = numJoints - 1 # Set a joint target for the position control and step the sim. self.setJointPosition(robotId, [0.1 * (i % 3) for i in range(numJoints)]) p.stepSimulation() # Get the joint and link state directly from Bullet. mpos, mvel, mtorq = self.getMotorJointStates(robotId) result = p.getLinkState(robotId, endEffectorIndex, computeLinkVelocity=1, computeForwardKinematics=1) link_trn, link_rot, com_trn, com_rot, frame_pos, frame_rot, link_vt, link_vr = result # Get the Jacobians for the CoM of the end-effector link. # Note that in this example com_rot = identity, and we would need to use com_rot.T * com_trn. # The localPosition is always defined in terms of the link frame coordinates. zero_vec = [0.0] * len(mpos) jac_t, jac_r = p.calculateJacobian(robotId, endEffectorIndex, com_trn, mpos, zero_vec, zero_vec) assert(allclose(dot(jac_t, mvel), link_vt)) assert(allclose(dot(jac_r, mvel), link_vr)) p.disconnect()