Skip to content

Commit

Permalink
correct spelling on ardupilot
Browse files Browse the repository at this point in the history
  • Loading branch information
RuffaloLavoisier authored and Hwurzburg committed Feb 5, 2022
1 parent 4c44687 commit 9230e6b
Show file tree
Hide file tree
Showing 10 changed files with 13 additions and 13 deletions.
2 changes: 1 addition & 1 deletion common/source/docs/common-blheli32-passthru.rst
Original file line number Diff line number Diff line change
Expand Up @@ -46,7 +46,7 @@ In a similar fashion, normal output rotation direction can be reversed by settin
BLHeli32 ESC Telemetry
----------------------

Many brushless BLHeli ESCs offer telemetry reporting of important ESC data, such as RPM, Temperature, Current, etc. for use in OSDs or for controlling ArudPilot functions like variable center frequency noise filters. This can be via a serial connection to one of the autopilot's UART RX inputs, whose ``SERIALx_PROTOCOL`` has been set to "16" (ESC Telemetry), or directly over its control connection if it has Bi-Directional DShot capability (only available on certain BLHeli32 capable ESCs at present).
Many brushless BLHeli ESCs offer telemetry reporting of important ESC data, such as RPM, Temperature, Current, etc. for use in OSDs or for controlling ArduPilot functions like variable center frequency noise filters. This can be via a serial connection to one of the autopilot's UART RX inputs, whose ``SERIALx_PROTOCOL`` has been set to "16" (ESC Telemetry), or directly over its control connection if it has Bi-Directional DShot capability (only available on certain BLHeli32 capable ESCs at present).

.. image:: ../../../images/dshot-telemwire.png
:target: https://shop.holybro.com/holybro-tekko32-esc35a_p1074.html
Expand Down
2 changes: 1 addition & 1 deletion common/source/docs/common-matek-m8q.rst
Original file line number Diff line number Diff line change
Expand Up @@ -4,7 +4,7 @@
Matek M8Q DroneCAN/MSP GPS/MAG/BARO
===================================

Based on ArudPilots' AP_Pheriph firmware, the Matek M8Q is a GPS+COMPASS+BAROMETER peripheral with CAN/DroneCAN and MSP interfaces to the autopilot, plus an I2C expansion bus for additional peripherals, such as airspeed sensors.
Based on ArduPilots' AP_Pheriph firmware, the Matek M8Q is a GPS+COMPASS+BAROMETER peripheral with CAN/DroneCAN and MSP interfaces to the autopilot, plus an I2C expansion bus for additional peripherals, such as airspeed sensors.

.. image:: ../../../images/M8Q-CAN_2.jpg

Expand Down
2 changes: 1 addition & 1 deletion common/source/docs/common-mro-kitcan.rst
Original file line number Diff line number Diff line change
Expand Up @@ -60,7 +60,7 @@ Pin Signal Name Voltage/Tolerance
4 GND --
========== =============== =================

.. note:: As delivered, the KitCAN will discover a MS5525 Airspeed sensor and/or any standard ArudPilot supported I2C Magnetometer that is connected to its I2C external bus
.. note:: As delivered, the KitCAN will discover a MS5525 Airspeed sensor and/or any standard ArduPilot supported I2C Magnetometer that is connected to its I2C external bus

Typical System
==============
Expand Down
2 changes: 1 addition & 1 deletion dev/source/docs/ap-peripheral-landing-page.rst
Original file line number Diff line number Diff line change
Expand Up @@ -45,7 +45,7 @@ Some (but not all) product examples using AP-Periph:
Firmware
========

Firmware for existing device definitions are posted `here <https://firmware.ardupilot.org/AP_Periph/>`__. Their hardware definition files are in the ArudPilot Github repository, `here <https://github.com/ArduPilot/ardupilot/tree/master/libraries/AP_HAL_ChibiOS/hwdef>`__
Firmware for existing device definitions are posted `here <https://firmware.ardupilot.org/AP_Periph/>`__. Their hardware definition files are in the ArduPilot Github repository, `here <https://github.com/ArduPilot/ardupilot/tree/master/libraries/AP_HAL_ChibiOS/hwdef>`__

To create firmware for a new design, follow the same instructions as for porting to a new autopilot board, as explained in the Wiki section :ref:`porting` .

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -240,19 +240,19 @@ Multiple installs of Arduino: It is important to note that Arduino has
only one location where the parameters are stored -
in C:\\Users\\....\\AppData\\Roaming\\Arduino\\preferences.txt. Any
time you start any installation of Arduino - a standard version, the
Arudpilot Arduino version or even changing settings in Visual Micro -
Ardupilot Arduino version or even changing settings in Visual Micro -
that file may get changed. So, it is very important to check all the
settings in the IDE you are using each time you change the IDE - to
avoid having the preferences set to that of the last IDE you used.

**Referencing a standard Arduino in Visual Micro:**
Normally, Visual Micro is setup to reference a standard installation of Arduino instead
of the special Arudpilot Ardunio for the HAL versions of APM. You can
of the special Ardupilot Ardunio for the HAL versions of APM. You can
configure Visual Studio or Atmel Studio to reference a standard
installation and it may build and upload the APM code but that upload
will not work. The build size is different and it does not connect to
Mission Planner. It is strongly suggested you only reference the special
Arudupilot Arduino installation when working with APM code.
Ardupilot Arduino installation when working with APM code.

**Using Arduino statements and libraries:**
This is better stated as
Expand Down
4 changes: 2 additions & 2 deletions dev/source/docs/learning-ardupilot-the-example-sketches.rst
Original file line number Diff line number Diff line change
Expand Up @@ -25,7 +25,7 @@ sketch on a Pixhawk:

::

cd $ARDUPILOT_HOME # the top-level of an AruPilot repository
cd $ARDUPILOT_HOME # the top-level of an ArduPilot repository
./waf configure --board=Pixhawk1
./waf build --target examples/INS_generic --upload

Expand Down Expand Up @@ -60,7 +60,7 @@ Certain sketches can also be run in SITL. For example to run the protocol decode

::

cd $ARDUPILOT_HOME # the top-level of an AruPilot repository
cd $ARDUPILOT_HOME # the top-level of an ArduPilot repository
./waf configure --board sitl
./waf build --target examples/RCProtocolDecoder
Expand Down
2 changes: 1 addition & 1 deletion plane/source/docs/geofencing.rst
Original file line number Diff line number Diff line change
Expand Up @@ -343,7 +343,7 @@ MAVLink support

ArduPilot will report the fence status via the MAVLink GCS protocol. The
key status packet is called FENCE_STATUS, and is defined in
"ardpilotmega.xml". A typical FENCE_STATUSpacket looks like this:
"ardupilotmega.xml". A typical FENCE_STATUSpacket looks like this:

::

Expand Down
2 changes: 1 addition & 1 deletion plane/source/docs/guide-tilt-rotor.rst
Original file line number Diff line number Diff line change
Expand Up @@ -203,7 +203,7 @@ ArduPilot tilt-rotor code:
- once a forward transition is completed then the motors will cover
any remaining angle at 90 degrees per second.

.. note:: For Binary type tilt servos these rates should be set at the actual measured rate of the servo since it's independent of ArudPilot control.
.. note:: For Binary type tilt servos these rates should be set at the actual measured rate of the servo since it's independent of ArduPilot control.

Tilt Stabilization Assist in Fixed Wing Flight
==============================================
Expand Down
2 changes: 1 addition & 1 deletion plane/source/docs/yaw-in-plane.rst
Original file line number Diff line number Diff line change
Expand Up @@ -23,7 +23,7 @@ In addition, ArduPilot produced yaw control can also occur:
Other YAW mechanisms
====================

If twin engines are used (THROTTLE LEFT and THROTTLE RIGHT output functions), then the pilot and ArudPilot can use differential thrust to produce yaw in Plane, or in Quadplanes when in fixed wing modes, if using twin/quad forward motors for fixed wing flight modes. This is enabled by setting :ref:`RUDD_DT_GAIN<RUDD_DT_GAIN>` to a non-zero value.
If twin engines are used (THROTTLE LEFT and THROTTLE RIGHT output functions), then the pilot and ArduPilot can use differential thrust to produce yaw in Plane, or in Quadplanes when in fixed wing modes, if using twin/quad forward motors for fixed wing flight modes. This is enabled by setting :ref:`RUDD_DT_GAIN<RUDD_DT_GAIN>` to a non-zero value.

Yaw Trim
========
Expand Down
2 changes: 1 addition & 1 deletion planner/source/docs/mission-planner-overview.rst
Original file line number Diff line number Diff line change
Expand Up @@ -80,7 +80,7 @@ Next, try a search of the website. If you still need help, then the
community forums are the place to go. There you will find may friendly
users, developers and often, even Michael will chime in.

The Arduilot forum `here <https://discuss.ardupilot.org/>`__ has existed
The Ardupilot forum `here <https://discuss.ardupilot.org/>`__ has existed
for years and has a very large community and numerous general and vehicle specific topics.


Expand Down

0 comments on commit 9230e6b

Please sign in to comment.