mirror of
https://github.com/ArduPilot/ardupilot
synced 2025-02-23 00:04:02 -04:00
mk: Fix typos
This commit is contained in:
parent
e129326be2
commit
e006754cda
@ -122,7 +122,7 @@ def is_valid_msg_type(x):
|
||||
base = bare_msg_type(x)
|
||||
if not is_legal_resource_name(base):
|
||||
return False
|
||||
#parse array indicies
|
||||
#parse array indices
|
||||
x = x[len(base):]
|
||||
state = 0
|
||||
i = 0
|
||||
|
@ -1,3 +1,3 @@
|
||||
# A representation of pose in free space, composed of postion and orientation.
|
||||
# A representation of pose in free space, composed of position and orientation.
|
||||
Point position
|
||||
Quaternion orientation
|
||||
|
@ -1,4 +1,4 @@
|
||||
# This represents force in free space, seperated into
|
||||
# This represents force in free space, separated into
|
||||
# it's linear and angular parts.
|
||||
Vector3 force
|
||||
Vector3 torque
|
||||
|
@ -56,7 +56,7 @@ uint32 width
|
||||
|
||||
# The distortion model used. Supported models are listed in
|
||||
# sensor_msgs/distortion_models.h. For most cameras, "plumb_bob" - a
|
||||
# simple model of radial and tangential distortion - is sufficent.
|
||||
# simple model of radial and tangential distortion - is sufficient.
|
||||
string distortion_model
|
||||
|
||||
# The distortion parameters, size depending on the distortion model.
|
||||
|
@ -1,4 +1,4 @@
|
||||
# extra rules for qualcomm flight build targetting the DSPs
|
||||
# extra rules for qualcomm flight build targeting the DSPs
|
||||
|
||||
# host name of flight board for "qurt_send" target
|
||||
FLIGHT_BOARD ?= flight4
|
||||
|
Loading…
Reference in New Issue
Block a user