def ApplyAction(self, motor_commands, motor_control_mode): """Apply the motor commands using the motor model. Args: motor_commands: np.array. Can be motor angles, torques, hybrid commands motor_control_mode: A MotorControlMode enum. """ dp.forward_kinematics(self.mb, self.mb.q, self.mb.qd) dp.forward_dynamics(self.mb, dp.Vector3(0., 0., -10.)) mb_q = vecx_to_np(self.mb.q)[7:] mb_qd = vecx_to_np(self.mb.qd)[6:] actual_torque, observed_torque = self._motor_model.convert_to_torque( motor_commands, mb_q, mb_qd, mb_qd, motor_control_mode=motor_control_mode) #print("actual_torque=",actual_torque) for i in range(len(actual_torque)): self.mb.tau[i] = actual_torque[i]
qcopy = mb.q print("mb.q=",mb.q) print("qcopy=",qcopy) for q_index in range (12): qcopy[q_index+7]=initial_poses[q_index] print("qcopy=",qcopy) mb.set_q(qcopy) print("2 mb.q=",mb.q) dt = 1./1000. skip_sync = 0 frame = 0 while 1: dp.forward_kinematics(mb, mb.q, mb.qd) dp.forward_dynamics(mb, dp.Vector3(0.,0.,-10.)) mb_q = vecx_to_np(mb.q)[7:] mb_qd = vecx_to_np(mb.qd)[6:] actual_torque, observed_torque = motor_model.convert_to_torque( initial_poses, mb_q, mb_qd, mb_qd, motor_control_mode=MOTOR_CONTROL_POSITION) #print("actual_torque=",actual_torque)
def __init__(self, simulation_time_step): self.MPC_BODY_MASS = MPC_BODY_MASS self.MPC_BODY_INERTIA = MPC_BODY_INERTIA self.MPC_BODY_HEIGHT = MPC_BODY_HEIGHT self.time_step = simulation_time_step self.num_legs = NUM_LEGS self.num_motors = NUM_MOTORS self.skip_sync = 0 self.world = dp.TinyWorld() self.world.friction = 10.0 self.mb_solver = dp.TinyMultiBodyConstraintSolver() self.vis = meshcat.Visualizer(zmq_url='tcp://127.0.0.1:6000') self.vis.delete() urdf_parser = dp.TinyUrdfParser() plane_urdf_data = urdf_parser.load_urdf( "../../../data/plane_implicit.urdf") plane2vis = meshcat_utils_dp.convert_visuals( plane_urdf_data, "../../../data/checker_purple.png", self.vis, "../../../data/") self.plane_mb = dp.TinyMultiBody(False) plane2mb = dp.UrdfToMultiBody2() res = plane2mb.convert2(plane_urdf_data, self.world, self.plane_mb) self.urdf_data = urdf_parser.load_urdf( "../../../data/laikago/laikago_toes_zup_joint_order.urdf") print("robot_name=", self.urdf_data.robot_name) self.b2vis = meshcat_utils_dp.convert_visuals( self.urdf_data, "../../../data/laikago/laikago_tex.jpg", self.vis, "../../../data/laikago/") is_floating = True self.mb = dp.TinyMultiBody(is_floating) urdf2mb = dp.UrdfToMultiBody2() self.res = urdf2mb.convert2(self.urdf_data, self.world, self.mb) self.mb.set_base_position(dp.Vector3(0, 0, 0.6)) knee_angle = -0.5 abduction_angle = 0.2 self.initial_poses = [ abduction_angle, 0., knee_angle, abduction_angle, 0., knee_angle, abduction_angle, 0., knee_angle, abduction_angle, 0., knee_angle ] qcopy = self.mb.q print("mb.q=", self.mb.q) print("qcopy=", qcopy) for q_index in range(12): qcopy[q_index + 7] = self.initial_poses[q_index] print("qcopy=", qcopy) self.mb.set_q(qcopy) print("2 mb.q=", self.mb.q) print("self.mb.links=", self.mb.links) print("TDS:") for i in range(len(self.mb.links)): print("i=", i) l = self.mb.links[i] #print("l.link_name=", l.link_name) print("l.joint_name=", l.joint_name) dp.forward_kinematics(self.mb, self.mb.q, self.mb.qd) self._BuildJointNameToIdDict() self._BuildUrdfIds() self._BuildMotorIdList() self.ResetPose() self._motor_enabled_list = [True] * self.num_motors self._step_counter = 0 self._state_action_counter = 0 self._motor_offset = np.array([0.] * 12) self._motor_direction = np.array([1.] * 12) self.ReceiveObservation() self._kp = self.GetMotorPositionGains() self._kd = self.GetMotorVelocityGains() self._motor_model = LaikagoMotorModel( kp=self._kp, kd=self._kd, motor_control_mode=MOTOR_CONTROL_HYBRID) self.ReceiveObservation() self.mb.set_base_position( dp.Vector3(START_POS[0], START_POS[1], START_POS[2])) self.mb.set_base_orientation( dp.Quaternion(START_ORN[0], START_ORN[1], START_ORN[2], START_ORN[3])) dp.forward_kinematics(self.mb, self.mb.q, self.mb.qd) meshcat_utils_dp.sync_visual_transforms(self.mb, self.b2vis, self.vis) self._SettleDownForReset(reset_time=1.0)