Skip to content

Commit

Permalink
tree-wide: fix typos in doc and comments
Browse files Browse the repository at this point in the history
This should not change any generated binary
  • Loading branch information
maribu committed Oct 16, 2023
1 parent 4452f07 commit edc4320
Show file tree
Hide file tree
Showing 61 changed files with 79 additions and 79 deletions.
2 changes: 1 addition & 1 deletion CODING_CONVENTIONS.md
Original file line number Diff line number Diff line change
Expand Up @@ -257,7 +257,7 @@ Wrong:
functionality.
* Every function must be documented - including parameters and return value.

An examplary doxygen documentation in a header file can look like this.
An exemplary doxygen documentation in a header file can look like this.

```
/*
Expand Down
2 changes: 1 addition & 1 deletion boards/airfy-beacon/doc.txt
Original file line number Diff line number Diff line change
Expand Up @@ -82,7 +82,7 @@ SUBSYSTEMS=="usb", ATTRS{idVendor}=="0483", ATTRS{idProduct}=="3748", \
# If you share your linux system with other users, or just don't like the
# idea of write permission for everybody, you can replace MODE:="0666" with
# OWNER:="yourusername" to create the device owned by you, or with
# GROUP:="somegroupname" and mange access using standard unix groups.
# GROUP:="somegroupname" and manage access using standard unix groups.

> sudo cp 49-stlinkv2.rules /etc/udev/rules.d/
> sudo udevadm control --reload-rules
Expand Down
2 changes: 1 addition & 1 deletion boards/frdm-k64f/doc.txt
Original file line number Diff line number Diff line change
Expand Up @@ -55,7 +55,7 @@ See also the ARMmbed
[instructions](https://developer.mbed.org/platforms/FRDM-K64F/#getting-started-
with-mbed).

## Updating the Booloader
## Updating the Bootloader
A update of CMSIS-DAP firmware is necessary to using the board with OpenOCD.
A good step by step guide is available
[here](https://developer.mbed.org/handbook/Firmware-FRDM-K64F).
Expand Down
2 changes: 1 addition & 1 deletion boards/iotlab-m3/doc.txt
Original file line number Diff line number Diff line change
Expand Up @@ -76,7 +76,7 @@ b <breakpoint>
c
```
For best debugging experience also change the `-Os` flag in
`Makefile.inlcude`'s `CFLAGS` variable to `-O0`.
`Makefile.include`'s `CFLAGS` variable to `-O0`.

## Details
The M3 Open Node can reset, debug and program the STM32 on JTAG through the
Expand Down
2 changes: 1 addition & 1 deletion boards/spark-core/doc.txt
Original file line number Diff line number Diff line change
Expand Up @@ -52,7 +52,7 @@ SUBSYSTEMS=="usb", ATTRS{idVendor}=="1d50", ATTRS{idProduct}=="607f", \
# If you share your linux system with other users, or just don't like the
# idea of write permission for everybody, you can replace MODE:="0666" with
# OWNER:="yourusername" to create the device owned by you, or with
# GROUP:="somegroupname" and mange access using standard unix groups.
# GROUP:="somegroupname" and manage access using standard unix groups.

sudo cp 50-openmoko.rules /etc/udev/rules.d/
sudo udevadm control --reload-rules
Expand Down
2 changes: 1 addition & 1 deletion core/include/mutex.h
Original file line number Diff line number Diff line change
Expand Up @@ -392,7 +392,7 @@ void mutex_unlock_and_sleep(mutex_t *mutex);
* @ref mutex_lock_cancelable. (You can reinitialize the same memory
* to safely reuse it.)
* @warning You ***MUST NOT*** call this function once the thread referred to by
* @p mc re-uses the mutex object referred to by @p mc (not counting
* @p mc reuses the mutex object referred to by @p mc (not counting
* the call to @ref mutex_lock_cancelable @p mc was used in).
* @note It is safe to call this function from IRQ context, e.g. from a timer
* interrupt.
Expand Down
4 changes: 2 additions & 2 deletions core/msg.c
Original file line number Diff line number Diff line change
Expand Up @@ -216,7 +216,7 @@ static int _msg_send_oneway(msg_t *m, kernel_pid_t target_pid)

sched_set_status(target, STATUS_PENDING);

/* Interrupts are disabled here, we can set / re-use
/* Interrupts are disabled here, we can set / reuse
sched_context_switch_request. */
sched_context_switch_request = 1;

Expand Down Expand Up @@ -280,7 +280,7 @@ int msg_send_receive(msg_t *m, msg_t *reply, kernel_pid_t target_pid)
sched_set_status(me, STATUS_REPLY_BLOCKED);
me->wait_data = reply;

/* we re-use (abuse) reply for sending, because wait_data might be
/* we reuse (abuse) reply for sending, because wait_data might be
* overwritten if the target is not in RECEIVE_BLOCKED */
*reply = *m;
/* msg_send blocks until reply received */
Expand Down
2 changes: 1 addition & 1 deletion cpu/esp8266/periph/adc.c
Original file line number Diff line number Diff line change
Expand Up @@ -37,7 +37,7 @@ int adc_init(adc_t line)
{
CHECK_PARAM_RET (line < ADC_NUMOF, -1)

/* no special inialization needed */
/* no special initialization needed */
return 0;
}

Expand Down
2 changes: 1 addition & 1 deletion cpu/esp_common/esp-wifi/doc.txt
Original file line number Diff line number Diff line change
Expand Up @@ -88,7 +88,7 @@ following configuration parameters have to be defined:
Parameter | Default | Description
:------------------|:----------|:------------
WIFI_SSID | "RIOT_AP" | SSID of the AP to be used.
WIFI_EAP_ID | none | Optional anonymous identity used in phase 1 (outer) EAP authentication. If it is not defined, the user name defined for phase 2 (inner) EAP authentication is used as idendity in phase 1.
WIFI_EAP_ID | none | Optional anonymous identity used in phase 1 (outer) EAP authentication. If it is not defined, the user name defined for phase 2 (inner) EAP authentication is used as identity in phase 1.
WIFI_EAP_USER | none | User name used in phase 2 (inner) EAP authentication.
WIFI_EAP_PASS | none | Password used in phase 2 (inner) EAP authentication.
ESP_WIFI_STACKSIZE | #THREAD_STACKSIZE_DEFAULT | Stack size used for the WiFi netdev driver thread.
Expand Down
2 changes: 1 addition & 1 deletion cpu/nrf52/radio/nrf802154/nrf802154_radio.c
Original file line number Diff line number Diff line change
Expand Up @@ -566,7 +566,7 @@ void isr_radio(void)
case STATE_ACK:
_state = STATE_IDLE;

/* We disable the radio to avoid unwanted emmissions (see ERRATA
/* We disable the radio to avoid unwanted emissions (see ERRATA
* ID 204, "Switching between TX and RX causes unwanted emissions")
*/
_disable();
Expand Down
2 changes: 1 addition & 1 deletion cpu/sam0_common/periph/timer.c
Original file line number Diff line number Diff line change
Expand Up @@ -310,7 +310,7 @@ unsigned int timer_read(tim_t tim)
return 0;
}

/* request syncronisation */
/* request synchronisation */
#ifdef TC_CTRLBSET_CMD_READSYNC_Val
dev(tim)->CTRLBSET.reg = TC_CTRLBSET_CMD_READSYNC;
/* work around a possible hardware bug where it takes some
Expand Down
2 changes: 1 addition & 1 deletion cpu/sam0_common/sam0_sdhc/sdhc.c
Original file line number Diff line number Diff line change
Expand Up @@ -1038,7 +1038,7 @@ static bool sdio_test_type(sdhc_state_t *state)

/*
* Wait card ready
* Timeout 1s = 400KHz / ((6+4)*8) cylces = 5000 retry
* Timeout 1s = 400KHz / ((6+4)*8) cycles = 5000 retry
* 6 = cmd byte size
* 4(SPI) 6(MCI) = response byte size
*/
Expand Down
2 changes: 1 addition & 1 deletion cpu/stm32/cpu_init.c
Original file line number Diff line number Diff line change
Expand Up @@ -219,7 +219,7 @@ static inline uint32_t _multi_read_reg32(volatile uint32_t *addr, bool *glitch)
* Think of this as a STM32-specific version of the Rowhammer attack.
*
* RDP may not be set correctly due to manufacturing error, glitch or
* intentional attack. It's done thrice to reduce the probablility of a
* intentional attack. It's done thrice to reduce the probability of a
* glitch attack succeeding amongst all of the multireads desgned to make it
* tougher.
*
Expand Down
2 changes: 1 addition & 1 deletion cpu/stm32/periph/can.c
Original file line number Diff line number Diff line change
Expand Up @@ -480,7 +480,7 @@ static int read_frame(can_t *dev, struct can_frame *frame, int mailbox)
frame->data[j] = (can->sFIFOMailBox[mailbox].RDHR >> ((j - 4) * 8)) & 0xFF;
}

/* filter number matching the reveived frame */
/* filter number matching the received frame */
/* filter = (can->sFIFOMailBox[mailbox].RDTR & CAN_RDT0R_FMI) >> CAN_RDTxR_FMI_SHIFT; */

/* Release input mailbox */
Expand Down
4 changes: 2 additions & 2 deletions drivers/include/at86rf2xx.h
Original file line number Diff line number Diff line change
Expand Up @@ -574,7 +574,7 @@ void at86rf2xx_tx_exec(at86rf2xx_t *dev);
bool at86rf2xx_cca(at86rf2xx_t *dev);

/**
* @brief Enable the smart receive tecnology (SRT)
* @brief Enable the smart receive technology (SRT)
*
* The SRT reduces the power consumption during RX listening periods.
*
Expand All @@ -584,7 +584,7 @@ bool at86rf2xx_cca(at86rf2xx_t *dev);
void at86rf2xx_enable_smart_idle(at86rf2xx_t *dev);

/**
* @brief Disable the smart receive tecnology (SRT)
* @brief Disable the smart receive technology (SRT)
*
* @param[in] dev device to use
*
Expand Down
2 changes: 1 addition & 1 deletion drivers/include/bme680.h
Original file line number Diff line number Diff line change
Expand Up @@ -281,7 +281,7 @@ int bme680_force_measurement(bme680_t *dev);
*
* @param[in,out] dev device descriptor of the sensor
*
* @return duration of one THPG measurement cylce in milliseconds.
* @return duration of one THPG measurement cycle in milliseconds.
* @return < 0 on error
*/
int bme680_get_duration(bme680_t* dev);
Expand Down
4 changes: 2 additions & 2 deletions drivers/include/l3gxxxx.h
Original file line number Diff line number Diff line change
Expand Up @@ -633,7 +633,7 @@
* ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
*
* If module `l3gxxxx_fifo` is used, the corresponding interrupt sources can
* be testsed.
* be tested.
*
* ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~{.c}
* l3gxxxx_int_src_t int_src = l3gxxxx_wait_int(&dev);
Expand Down Expand Up @@ -1278,7 +1278,7 @@ typedef struct {
for threshold comparison */

bool and_or; /**< Combination of interrupt events (true=AND, false=OR):<br>
AND - all enabled axes passed their tresholds<br>
AND - all enabled axes passed their thresholds<br>
OR - at least one axis passed its threshold */
bool latch; /**< Latch the interrupt when true until the interrupt
source has been read by function l3gxxxx_wait_int. */
Expand Down
2 changes: 1 addition & 1 deletion drivers/include/nrf24l01p.h
Original file line number Diff line number Diff line change
Expand Up @@ -311,7 +311,7 @@ int nrf24l01p_set_address_width(const nrf24l01p_t *dev, nrf24l01p_aw_t aw);
*
* @ note
* This function sets the payload width for one packet. If the maximum of 32 bytes is
* exeeded, this value is set to 32.
* exceeded, this value is set to 32.
*
* @param[in] dev Transceiver device to use.
* @param[in] pipe RX pipe to set the payload width.
Expand Down
4 changes: 2 additions & 2 deletions drivers/include/sdmmc/sdmmc.h
Original file line number Diff line number Diff line change
Expand Up @@ -36,7 +36,7 @@
*
* 1. The high-level API that implements the SD Host Controller driver and
* allows
* - to inititialize and identify different types of cards,
* - to initialize and identify different types of cards,
* - to access them either blockwise or bytewise,
* - to get information about the used card, and
* - to send single commands or application specific commands to the card.
Expand Down Expand Up @@ -676,7 +676,7 @@ typedef struct __attribute__((packed)) {
/**
* @brief CSD register structure Version 2.0 and Version 3.0
*
* A combined format is used vor CSD Version 2.0 and 3.0 to reduce the code
* A combined format is used for CSD Version 2.0 and 3.0 to reduce the code
* size. The only difference is the bit length of `C_SIZE`.
*
* @see Physical Layer Simplified Specification Version 9.00
Expand Down
2 changes: 1 addition & 1 deletion drivers/include/shtcx.h
Original file line number Diff line number Diff line change
Expand Up @@ -81,7 +81,7 @@ int8_t shtcx_init(shtcx_t* const dev, const shtcx_params_t* params);

/**
* @brief Reads all register values from the device.
* @details The values as raw data will be saved into reveived.
* @details The values as raw data will be saved into received.
*
* @param[in] dev The I2C device descriptor.
* @param[in] rel_humidity Humidity in centi %.
Expand Down
6 changes: 3 additions & 3 deletions drivers/mpu9x50/mpu9x50.c
Original file line number Diff line number Diff line change
Expand Up @@ -455,7 +455,7 @@ int mpu9x50_set_compass_sample_rate(mpu9x50_t *dev, uint8_t rate)
/**
* Initialize compass
* Caution: This internal function does not acquire exclusive access to the I2C bus.
* Acquisation and release is supposed to be handled by the calling function.
* Acquisition and release is supposed to be handled by the calling function.
*/
static int compass_init(mpu9x50_t *dev)
{
Expand Down Expand Up @@ -524,7 +524,7 @@ static int compass_init(mpu9x50_t *dev)
/**
* Configure bypass mode
* Caution: This internal function does not acquire exclusive access to the I2C bus.
* Acquisation and release is supposed to be handled by the calling function.
* Acquisition and release is supposed to be handled by the calling function.
*/
static void conf_bypass(const mpu9x50_t *dev, uint8_t bypass_enable)
{
Expand All @@ -548,7 +548,7 @@ static void conf_bypass(const mpu9x50_t *dev, uint8_t bypass_enable)
/**
* Configure low pass filter
* Caution: This internal function does not acquire exclusive access to the I2C bus.
* Acquisation and release is supposed to be handled by the calling function.
* Acquisition and release is supposed to be handled by the calling function.
*/
static void conf_lpf(const mpu9x50_t *dev, uint16_t half_rate)
{
Expand Down
2 changes: 1 addition & 1 deletion drivers/saul/init_devs/auto_init_sdp3x.c
Original file line number Diff line number Diff line change
Expand Up @@ -64,7 +64,7 @@ void auto_init_sdp3x(void)
saul_reg_add(&saul_entries[se_ix]);
se_ix++;

/* differential presure */
/* differential pressure */
saul_entries[se_ix].dev = &sdp3x_devs[i];
saul_entries[se_ix].name = sdp3x_saul_info[i].name;
saul_entries[se_ix].driver = &sdp3x_differential_pressure_saul_driver;
Expand Down
4 changes: 2 additions & 2 deletions makefiles/defaultmodules_deps.inc.mk
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
# This files contains dependencies for default modules. They are parsed at the
# end of the dependency loop. They MAY inlcude new modules, but this modules
# MUST NOT have dependencies themselfs.
# end of the dependency loop. They MAY include new modules, but this modules
# MUST NOT have dependencies themselves.

ifneq (,$(filter auto_init%,$(USEMODULE)))
USEMODULE += preprocessor preprocessor_successor
Expand Down
4 changes: 2 additions & 2 deletions pkg/flashdb/doc.txt
Original file line number Diff line number Diff line change
Expand Up @@ -61,11 +61,11 @@
* ==================
* To enable the Key-Value database, select the `flashdb_kvdb` module.
*
* For use of the FlashDB API, reffer to the [FlashDB documentation](http://armink.gitee.io/flashdb/#/sample-kvdb-basic).
* For use of the FlashDB API, refer to the [FlashDB documentation](http://armink.gitee.io/flashdb/#/sample-kvdb-basic).
*
* Time series database
* ====================
* To enable the Key-Value database, select the `flashdb_tsdb` module.
*
* For use of the FlashDB API, reffer to the [FlashDB documentation](http://armink.gitee.io/flashdb/#/sample-tsdb-basic).
* For use of the FlashDB API, refer to the [FlashDB documentation](http://armink.gitee.io/flashdb/#/sample-tsdb-basic).
*/
2 changes: 1 addition & 1 deletion pkg/micropython/doc.txt
Original file line number Diff line number Diff line change
Expand Up @@ -35,7 +35,7 @@
* The RIOT port of MicroPython currently resides in a fork at
* https://github.com/kaspar030/micropython (in branch add_riot_port). It is
* based on Micropython's "ports/minimal" with some extra modules enabled.
* It re-uses the gc_collect code from ports/unix, which has special support
* It reuses the gc_collect code from ports/unix, which has special support
* for i386 and Cortex-M. On other platforms, it uses setjmp() to collect
* registers.
*
Expand Down
2 changes: 1 addition & 1 deletion pkg/nimble/contrib/nimble_riot.c
Original file line number Diff line number Diff line change
Expand Up @@ -142,7 +142,7 @@ void nimble_riot_init(void)
while (!ble_hs_synced()) {}

/* for reducing code duplication, we read our own address type once here
* so it can be re-used later on */
* so it can be reused later on */
res = ble_hs_util_ensure_addr(0);
assert(res == 0);
res = ble_hs_id_infer_auto(0, &nimble_riot_own_addr_type);
Expand Down
2 changes: 1 addition & 1 deletion pkg/tinyusb/hw/include/nrf52/nrf_clock.h
Original file line number Diff line number Diff line change
Expand Up @@ -43,7 +43,7 @@ typedef enum {
} nrf_clock_task_t;

/**
* @brief Status HF clock acitvation/deactivation in `dcd_nrf52.c`
* @brief Status HF clock activation/deactivation in `dcd_nrf52.c`
*
* The `clock_hfxo_request` and `clock_hfxo_release` functions are used in
* RIOT to enable/disable the HF clock if necessary. Since `hfclk_enable`
Expand Down
8 changes: 4 additions & 4 deletions release-notes.txt
Original file line number Diff line number Diff line change
Expand Up @@ -1442,7 +1442,7 @@ Build System / Tooling
+ .vscode: import initial RIOT-OS style (#18945)
+ build-system: add capability to execute scripts with custom executor (#18770)
+ dist/tools: add "RESET_PIN" value for the dwm1001 (#18815)
+ examples/gnrc_border_router: add option to re-use existing TAP
+ examples/gnrc_border_router: add option to reuse existing TAP
interface (#18836)
+ makefiles/tools/serial.inc.mk: add support for bootterm (#18749)
+ tapsetup: add --loss & --delay option (#18885)
Expand Down Expand Up @@ -3633,7 +3633,7 @@ Packages
* pkg/littlefs2: bump version to 2.4.2 (#17837)
* pkg/lv_drivers: initial commit (#17713)
* pkg/lvgl: bump to 8.2.0 (#17681)
* pkg/lvlgl: allow cusomizing LV_MEM_SIZE (#17759)
* pkg/lvlgl: allow customizing LV_MEM_SIZE (#17759)
+ pkg/mbedtls: initial pkg import to use entropy module (#15671)
* pkg/mynewt-core: fix semaphore (#17771)
* pkg/semtech-loramac: enable setting channels mask (#17824)
Expand Down Expand Up @@ -5848,7 +5848,7 @@ System Libraries (21)
+ sys/event: add periodic timeout event (#16507)
+ sys/ps: enable runtime_usec output for the ps command (#16470)
* gnrc_dhcpv6_client_6lbr: choose downstream if as !upstream (#16530)
* net/emcute: Allow RETAIN flag to be set on incoming PUBLISHs (#16326)
* net/emcute: Allow RETAIN flag to be set on incoming PUBLISHes (#16326)
* net/gnrc/rpl: use ztimer_msec if available (#16339)
* net/grnc/sixlowpan/ctx: use ztimer_msec if available (#16340)
* sys/arduino: replace xtimer by ztimer as high-level background timer (#15317)
Expand Down Expand Up @@ -13615,7 +13615,7 @@ Drivers
Build System
------------
+ Experimental distributed building using Murdock
+ most makfiles moved from root into makefiles/
+ most makefiles moved from root into makefiles/
+ added submodule support

Special Thanks
Expand Down
2 changes: 1 addition & 1 deletion sys/cpp11-compat/include/riot/thread.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -317,7 +317,7 @@ void swap(thread& lhs, thread& rhs) noexcept;
/** @cond INTERNAL */
template <class Tuple>
void* thread_proxy(void* vp) {
{ // without this scope, the objects here are not cleaned up corrctly
{ // without this scope, the objects here are not cleaned up correctly
std::unique_ptr<Tuple> p(static_cast<Tuple*>(vp));
auto tmp = std::get<0>(*p);
std::unique_ptr<thread_data, thread_data_deleter> data{tmp};
Expand Down
2 changes: 1 addition & 1 deletion sys/crypto/chacha.c
Original file line number Diff line number Diff line change
Expand Up @@ -26,7 +26,7 @@
* - This implementation of the ChaCha stream cipher is very stripped down.
* - It assumes a little-endian system.
* - It is implemented for little code and data size, but will likely be
* slower than the refenrence implementation. Optimized implementation will
* slower than the reference implementation. Optimized implementation will
* out-perform the code even more.
*/

Expand Down
6 changes: 3 additions & 3 deletions sys/fido2/ctap/ctap.c
Original file line number Diff line number Diff line change
Expand Up @@ -616,7 +616,7 @@ static int _get_assertion(ctap_req_t *req_raw)
goto done;
}

/* find eligble credentials */
/* find eligible credentials */
_assert_state.count = _find_matching_rks(_assert_state.rks,
CTAP_MAX_EXCLUDE_LIST_SIZE,
req.allow_list,
Expand Down Expand Up @@ -693,7 +693,7 @@ static int _get_assertion(ctap_req_t *req_raw)
memcpy(_assert_state.client_data_hash, req.client_data_hash,
SHA256_DIGEST_LENGTH);

/* most recently created eligble rk found */
/* most recently created eligible rk found */
rk = &_assert_state.rks[_assert_state.cred_counter++];

/* last moment where transaction can be cancelled */
Expand Down Expand Up @@ -780,7 +780,7 @@ static int _get_next_assertion(void)
goto done;
}

/* next eligble rk */
/* next eligible rk */
rk = &_assert_state.rks[_assert_state.cred_counter];
_assert_state.cred_counter++;

Expand Down
2 changes: 1 addition & 1 deletion sys/fido2/ctap/ctap_cbor.c
Original file line number Diff line number Diff line change
Expand Up @@ -1557,7 +1557,7 @@ static int _parse_options(CborValue *it, ctap_options_t *options)
}
else {
/* ignore unknown options */
DEBUG("Ctap parse options, unknown uption: %s \n", key);
DEBUG("Ctap parse options, unknown option: %s \n", key);
}

cbor_value_advance(&map);
Expand Down
Loading

0 comments on commit edc4320

Please sign in to comment.