-
Notifications
You must be signed in to change notification settings - Fork 0
/
Copy pathheadset.py
300 lines (235 loc) · 11.5 KB
/
headset.py
1
2
3
4
5
6
7
8
9
10
11
12
13
14
15
16
17
18
19
20
21
22
23
24
25
26
27
28
29
30
31
32
33
34
35
36
37
38
39
40
41
42
43
44
45
46
47
48
49
50
51
52
53
54
55
56
57
58
59
60
61
62
63
64
65
66
67
68
69
70
71
72
73
74
75
76
77
78
79
80
81
82
83
84
85
86
87
88
89
90
91
92
93
94
95
96
97
98
99
100
101
102
103
104
105
106
107
108
109
110
111
112
113
114
115
116
117
118
119
120
121
122
123
124
125
126
127
128
129
130
131
132
133
134
135
136
137
138
139
140
141
142
143
144
145
146
147
148
149
150
151
152
153
154
155
156
157
158
159
160
161
162
163
164
165
166
167
168
169
170
171
172
173
174
175
176
177
178
179
180
181
182
183
184
185
186
187
188
189
190
191
192
193
194
195
196
197
198
199
200
201
202
203
204
205
206
207
208
209
210
211
212
213
214
215
216
217
218
219
220
221
222
223
224
225
226
227
228
229
230
231
232
233
234
235
236
237
238
239
240
241
242
243
244
245
246
247
248
249
250
251
252
253
254
255
256
257
258
259
260
261
262
263
264
265
266
267
268
269
270
271
272
273
274
275
276
277
278
279
280
281
282
283
284
285
286
287
288
289
290
291
292
293
294
295
296
297
298
299
300
import pybullet as p
import pybullet_data
import time
import os
import math
import numpy as np
from headset_mock import Headset
# Set up PyBullet environment
current_dir = os.path.dirname(os.path.realpath(__file__))
urdf_path = os.path.join(current_dir, 'stridebot.urdf')
# Connect to PyBullet
physicsClient = p.connect(p.GUI)
p.setRealTimeSimulation(1)
p.setAdditionalSearchPath(pybullet_data.getDataPath())
p.setGravity(0, 0, -9.8)
# Load a plane for the robot to walk on
planeId = p.loadURDF('plane.urdf')
# Define initial position and orientation of the robot
cubeStartPos = [0, 0, 0.4]
cubeStartOrientation = p.getQuaternionFromEuler([0, 0, 0])
# Load the custom quadruped robot URDF
# THIS IS NOT THE GOAL BOX, this refers to the body of the robot
boxId = p.loadURDF(urdf_path, cubeStartPos, cubeStartOrientation)
num_joints = p.getNumJoints(boxId)
print(f"Number of joints: {num_joints}")
# Set up initial dynamics for the robot's legs to ensure good ground contact
for joint in range(num_joints):
p.changeDynamics(boxId, joint, lateralFriction=10.0)
# Function to update the camera to follow the robot
def update_camera(robot_id, camera_distance=2):
robot_pos, robot_orientation = p.getBasePositionAndOrientation(robot_id)
robot_euler = p.getEulerFromQuaternion(robot_orientation)
robot_yaw = robot_euler[2] # yaw is the rotation around the z-axis
camera_yaw = robot_yaw * (180.0 / math.pi)
# Update the camera with the calculated yaw
p.resetDebugVisualizerCamera(
cameraDistance=camera_distance,
cameraYaw=p.getDebugVisualizerCamera()[8], # p.getDebugVisualizerCamera()[8] # camera_yaw + 90
cameraPitch=-30,
cameraTargetPosition=robot_pos
)
# Function to move joints with velocity control for smoother motion
# Joint indices for rotational and prismatic joints
rotational_joints = [1, 3, 5, 7] # Indices of the rotational joints for each leg
prismatic_joints = [0, 2, 4, 6] # Indices of the prismatic joints for each leg
# Function to move both prismatic and rotational joints
def move_joints(robot_id, prismatic_positions, rotational_positions, rotational_force, prismatic_force = 50):
# Move prismatic joints (vertical movement)
for joint_index, position in enumerate(prismatic_positions):
p.setJointMotorControl2(
bodyUniqueId=robot_id,
jointIndex=prismatic_joints[joint_index], # Prismatic joints
controlMode=p.POSITION_CONTROL,
targetPosition=position, # Target vertical position
force=prismatic_force,
)
# Move rotational joints (leg movement)
for joint_index, position in enumerate(rotational_positions):
p.setJointMotorControl2(
bodyUniqueId=robot_id,
jointIndex=rotational_joints[joint_index], # Rotational joints
controlMode=p.POSITION_CONTROL,
targetPosition=position, # Target angular position
force=rotational_force,
maxVelocity=4
)
calculate = False
last_box_id = None
# Modify perform_trot_gait to control both prismatic and rotational joints
def perform_trot_gait(robot_id, step_length=0.3, step_height=0.1, speed=0.1):
global calculate
phase_offset = math.pi # Offset for alternating legs
prismatic_offset = math.pi / 2
# Indices for diagonal pairs of legs
diagonal_1 = [0, 3] # Front left and back right
diagonal_2 = [1, 2] # Front right and back left
time_step = 0
start_time = time.time() # Record the start time
while True:
time_step += speed
prismatic_positions = [0] * len(prismatic_joints)
rotational_positions = [0] * len(rotational_joints)
# Move diagonal_1 (front left and back right) first
for joint in diagonal_1:
rotational_positions[joint] = step_length * math.sin(time_step) # Forward/backward motion
if math.sin(time_step + prismatic_offset) > 0:
prismatic_positions[joint] = step_height # Lift the leg
else:
prismatic_positions[joint] = 0 # Push the leg down during stance
# Move diagonal_2 (front right and back left) with a phase offset
for joint in diagonal_2:
rotational_positions[joint] = step_length * math.sin(time_step + phase_offset)
if math.sin(time_step + phase_offset + prismatic_offset) > 0:
prismatic_positions[joint] = step_height # Lift the leg
else:
prismatic_positions[joint] = 0 # Push the leg down during stance
# Apply prismatic and rotational joint movements
move_joints(robot_id, prismatic_positions, rotational_positions, rotational_force = 600)
# Step the simulation and update the camera
p.stepSimulation()
update_camera(robot_id)
time.sleep(1./240.)
if (ord('e') not in p.getKeyboardEvents() and step_length == 0.3) or (ord('d') not in p.getKeyboardEvents() and step_length == -0.3):
break
if (calculate):
calculate_angle_and_distance(robot_id=boxId, box_id=last_box_id)
def do_nothing(robot_id):
global calculate
start_time = time.time() # Record the start time
while True:
p.stepSimulation()
update_camera(robot_id)
time.sleep(1./240.)
keys = p.getKeyboardEvents()
if ord('e') in keys or ord('s') in keys or ord('d') in keys or ord('f') in keys or ord('k') in keys or ord('h') in keys or ord('u') in keys or ord('j') in keys:
break
if (calculate):
calculate_angle_and_distance(robot_id=boxId, box_id=last_box_id)
def rotate(robot_id, direction, step_height=0.2, rotation_angle=math.pi / 4, speed=0.2, steps_per_cycle = 5):
global calculate
# direction = True ---> Rotate right, direction = False ---> Rotate left
if (direction):
lift_joints = [1, 3] # Front-left and back-left
non_lift_joints = [0, 2]
else:
lift_joints = [0, 2] # Front-left and back-left
non_lift_joints = [1, 3]
# Initialize time tracking
time_step = 0
start_time = time.time()
while True:
if (ord('f') not in p.getKeyboardEvents() and direction) or (ord('s') not in p.getKeyboardEvents() and not direction):
break
time_step += speed
prismatic_positions = [0] * len(prismatic_joints)
rotational_positions = [0] * len(rotational_joints)
# Step 1: Lift the left-side legs using prismatic joints (jump)
for joint in lift_joints:
prismatic_positions[joint] = 0 # Lift the leg
for joint in non_lift_joints:
prismatic_positions[joint] = 0
# Apply the prismatic and rotational joint movements
move_joints(robot_id, prismatic_positions, rotational_positions, rotational_force = 600, prismatic_force = 1000)
# Step the simulation and update the camera
for _ in range(steps_per_cycle):
p.stepSimulation()
update_camera(robot_id)
time.sleep(1./240.)
for joint in (lift_joints + non_lift_joints):
prismatic_positions[joint] = step_height
for joint in lift_joints:
rotational_positions[joint] = rotation_angle * abs(math.sin(time_step)) # Rotate the leg forward
for joint in non_lift_joints:
rotational_positions[joint] = -rotation_angle * abs(math.sin(time_step)) # Rotate the leg forward
move_joints(robot_id, prismatic_positions, rotational_positions, rotational_force = 600, prismatic_force = 200)
for _ in range(steps_per_cycle):
p.stepSimulation()
update_camera(robot_id)
time.sleep(1./240.)
# Step 3: Bring the lifted legs back to the ground (lower)
for joint in lift_joints + non_lift_joints:
prismatic_positions[joint] = step_height # Lower the leg
rotational_positions[joint] = 0
# Apply the prismatic and rotational joint movements to return to the start
move_joints(robot_id, prismatic_positions, rotational_positions, rotational_force = 600, prismatic_force = 200)
# Step the simulation and update the camera
for _ in range(steps_per_cycle):
p.stepSimulation()
update_camera(robot_id)
time.sleep(1./240.)
if (calculate):
calculate_angle_and_distance(robot_id=boxId, box_id=last_box_id)
def spawn_box_in_direction_of_motion(robot_id, distance_ahead=1.0, side_offset = 0): # if offset is positive the box is to the right
distance_ahead = -distance_ahead
global last_box_id
if last_box_id is not None:
p.removeBody(last_box_id)
# Get the robot's current position and orientation
robot_pos, robot_orientation = p.getBasePositionAndOrientation(robot_id)
# Convert the orientation quaternion to Euler angles to get the yaw
robot_euler = p.getEulerFromQuaternion(robot_orientation)
robot_yaw = robot_euler[2] # yaw is the third element
forward_direction = [math.cos(robot_yaw), math.sin(robot_yaw), 0]
side_direction = [-math.sin(robot_yaw), math.cos(robot_yaw), 0]
box_position = [
robot_pos[0] + forward_direction[0] * distance_ahead + side_direction[0] * side_offset,
robot_pos[1] + forward_direction[1] * distance_ahead + side_direction[1] * side_offset,
robot_pos[2] + 0.3
]
current_dir = os.path.dirname(os.path.realpath(__file__))
cube_urdf_path = os.path.join(current_dir, "goal_box.urdf")
box_orientation = p.getQuaternionFromEuler([0, 0, 0])
# Spawn the new box and store its ID
last_box_id = p.loadURDF(cube_urdf_path, box_position, box_orientation)
def calculate_angle_and_distance(robot_id, box_id):
robot_pos, robot_orientation = p.getBasePositionAndOrientation(robot_id)
robot_euler = p.getEulerFromQuaternion(robot_orientation)
robot_yaw = robot_euler[2]
# Get the box's position
box_pos, _ = p.getBasePositionAndOrientation(box_id)
# Calculate the direction vector from robot to box
direction_to_box = np.array([box_pos[0] - robot_pos[0], box_pos[1] - robot_pos[1]])
# Calculate the forward direction of the robot
robot_forward = np.array([np.cos(robot_yaw), np.sin(robot_yaw)])
# Calculate the angle between the forward direction and the direction to the box
dot_product = np.dot(robot_forward, direction_to_box)
magnitude_product = np.linalg.norm(robot_forward) * np.linalg.norm(direction_to_box)
if magnitude_product == 0:
angle_degrees = 0
else:
cos_theta = dot_product / magnitude_product
angle_radians = np.arccos(np.clip(cos_theta, -1.0, 1.0))
angle_degrees = np.degrees(angle_radians)
distance = np.linalg.norm(direction_to_box)
angle_degrees -= 180
print(f"Angle between robot's front and box: {angle_degrees} degrees")
print(f"Distance between robot and box: {distance}")
# return angle_degrees, distance
def control_robot_with_keys(robot_id):
global calculate
headset = Headset()
while True:
action = headset.random_action()
if action == 1:
perform_trot_gait(boxId, step_length=0.3, step_height=0.2, speed=0.4)
else:
perform_trot_gait(boxId, step_length= -0.3, step_height=0.2, speed=0.4)
p.stepSimulation()
time.sleep(1./240.)
control_robot_with_keys(boxId)
# Get and print the final position and orientation of the robot
cubePos, cubeOrn = p.getBasePositionAndOrientation(boxId)
print(f"Final position: {cubePos}, Final orientation: {cubeOrn}")
# Properly disconnect from the physics server
p.disconnect()