1
0
mirror of https://github.com/RIOT-OS/RIOT.git synced 2024-12-29 04:50:03 +01:00

Merge pull request #15138 from aabadie/pr/dist/codespell_fixes

dist/codespell: update the list of ignored words and fix all typos
This commit is contained in:
Francisco 2020-10-02 12:27:12 +02:00 committed by GitHub
commit df3ab9f161
No known key found for this signature in database
GPG Key ID: 4AEE18F83AFDEB23
58 changed files with 168 additions and 84 deletions

View File

@ -58,7 +58,7 @@
uint8_t b;
} foobar_t;
```
* Use of a seperate line typedef for structs is allowed for forward
* Use of a separate line typedef for structs is allowed for forward
declarations, e.g.,
```
typedef struct mystruct mystruct_t;

View File

@ -60,7 +60,7 @@ Reason for removal:
- board cannot be automatically tested for lack of UART
- board has many special cases, which hurt upgrade to msp430-elf-gcc 9.x
- the onboard radio has been unsupported for a while
- noone seems to use the board, noone seems to maintain it
- no one seems to use the board, no one seems to maintain it
### sys/net/gnrc/application_layer/tftp [0e2a62078850e1ecc74db2db4d639cf2d8fb96d3]
Author:

View File

@ -9,7 +9,7 @@ The [Devawave DWM1001 development board](https://www.decawave.com/product/dwm100
includes a DWM1001 module which is based on a Nordic nRF51832 microcontroller.
This microcontroller is an ARM Cortex-M4 with 64KB of RAM and 512KB of flash
memory. It also provides in integrated BLE radio.
The DWM1001 module also contains an UWB tranceiver connected to the
The DWM1001 module also contains an UWB transceiver connected to the
microcontroller via SPI (not supported yet).
## Flash the board

View File

@ -74,7 +74,7 @@ extern "C" {
/** @} */
/**
* @name DW1000 UWB tranceiver
* @name DW1000 UWB transceiver
* @{
*/
#define DW1000_PARAM_SPI_DEV SPI_DEV(1)

View File

@ -50,7 +50,7 @@ static const spi_conf_t spi_config[] = {
.miso = GPIO_PIN(0, 6),
.ppi = 0,
},
{ /* Connected to the DWM1001 UWB tranceiver */
{ /* Connected to the DWM1001 UWB transceiver */
.dev = NRF_SPIM1,
.sclk = GPIO_PIN(0, 16),
.mosi = GPIO_PIN(0, 20),

View File

@ -34,7 +34,7 @@ features a variety of sensors as well as an OLED Display and a BLE
| Reference Manual | [Reference Manual](http://www.st.com/web/en/resource/technical/document/reference_manual/CD00240193.pdf) |
| Programming Manual | [Programming Manual](http://www.st.com/web/en/resource/technical/document/programming_manual/CD00228163.pdf) |
## User Inferface
## User Interface
2 Buttons:

View File

@ -6,7 +6,7 @@
## Overview:
There are some nameless simple development Boards with an nRF52832 available.
These boards providing access to most SoC ports. There are two buttons (RST,
KEY), two LEDs (Pin 30, 31), a voltage regulator and a current messurment shunt
KEY), two LEDs (Pin 30, 31), a voltage regulator and a current measurement shunt
on board. A serial connection and flashing must be provided by external
Hardware.

View File

@ -55,10 +55,10 @@ typedef struct {
*
* Must be called by the owner of a ``msg_bus_t`` struct.
*
* Message busses are considered to be long-running and must be
* Message buses are considered to be long-running and must be
* created before any threads can attach to them.
*
* There can be a maximum number of 2047 busses in total.
* There can be a maximum number of 2047 buses in total.
*/
void msg_bus_init(msg_bus_t *bus);
@ -80,7 +80,7 @@ static inline uint8_t msg_bus_get_type(const msg_t *msg)
/**
* @brief Check if a message originates from a certain bus
*
* If a thread is attached to multiple busses, this function can be used
* If a thread is attached to multiple buses, this function can be used
* to determine if a message originated from a certain bus.
*
* @param[in] bus The bus to check for
@ -128,7 +128,7 @@ void msg_bus_detach(msg_bus_t *bus, msg_bus_entry_t *entry);
* Traverse the message bus to find the subscriber entry for the
* current thread.
*
* @param[in] bus The message bus to seach
* @param[in] bus The message bus to search
*
* @return The subscriber entry for the current thread.
* NULL if the thread is not attached to @p bus.

View File

@ -164,7 +164,7 @@ extern "C" {
*
* `EXT_LF_CLK.RTC_INCREMENT = 2^38/InputClockFrequency in Hertz`
*
* For exmaple:
* For example:
*
* `RTC_INCREMENT=0x800000` for `InputClockFrequency=32768 Hz`
*/

View File

@ -79,7 +79,7 @@ extern "C" {
*
* Cortex-M CPUs allow interrupt priorities to be arranged in subgroups,
* meaning that any interrupts on the same subgroup will not
* pre-empt each other, but those on a lower sub-priority will run
* preempt each other, but those on a lower sub-priority will run
* only once all on the higher sub-priorities have been completed.
*
* The usual practice on Cortex-M is to run the PendSV interrupt
@ -119,10 +119,10 @@ extern "C" {
* By default, RIOT runs PendSV on the same interrupt priority with all
* other interrupts.
*
* For efficency (or other reasons), one may want to run the PendSV as
* For efficiency (or other reasons), one may want to run the PendSV as
* the last one, just before returning to the (next) thread. However,
* since PendSV triggers the RIOT scheduler _without_ interrupts being
* disabled, any interrupts that pre-empt the scheduler, including the
* disabled, any interrupts that preempt the scheduler, including the
* timer interrupts, must not call anything that may affect the
* scheduler, such as mutex or scheduler functions. With the current
* design of RIOT, writing interrupt handlers in such a manner is not

View File

@ -384,7 +384,7 @@ __attribute__((used)) void hard_fault_handler(uint32_t* sp, uint32_t corrupted,
/* Print the interrupt number, NMI being -14, hardfault is -13,
* IRQ0 is 0 and so on */
uint32_t psr = sp[7]; /* Program status register. */
printf("Hard fault occured in ISR number %d\n",
printf("Hard fault occurred in ISR number %d\n",
(int)(psr & 0xff) - 16);
}
puts("Attempting to reconstruct state for debugging...");

View File

@ -51,7 +51,7 @@ extern "C" {
#define RTC_DATA_ATTR __attribute__((section(".rtc.data")))
#endif
/** Print out a message that function is not yet implementd */
/** Print out a message that function is not yet implemented */
#define NOT_YET_IMPLEMENTED() LOG_INFO("%s not yet implemented\n", __func__)
/** Print out a message that function is not supported */
#define NOT_SUPPORTED() LOG_INFO("%s not supported\n", __func__)

View File

@ -172,10 +172,10 @@ int i2c_write_bytes(i2c_t dev, uint16_t address, const void *data, size_t length
static inline int _wait_busy(i2c_t dev, uint32_t max_timeout_counter)
{
uint32_t timeout_counter = 0;
DEBUG("[i2c] wait for transfert\n");
DEBUG("[i2c] wait for transfer\n");
while (_REG32(i2c_config[dev].addr, I2C_STATUS) & I2C_STATUS_TIP) {
if (++timeout_counter >= max_timeout_counter) {
DEBUG("[i2c] transfert timeout\n");
DEBUG("[i2c] transfer timeout\n");
return -ETIMEDOUT;
}
else if ((_REG32(i2c_config[dev].addr, I2C_STATUS) & I2C_STATUS_ALOST) == I2C_STATUS_ALOST) {

View File

@ -42,7 +42,7 @@ typedef void (*native_async_read_callback_t)(int fd, void *arg);
*/
typedef struct {
pid_t child_pid; /**< PID of the interrupt listener */
native_async_read_callback_t cb; /**< Interrupt callback funtion */
native_async_read_callback_t cb; /**< Interrupt callback function */
void *arg; /**< Argument ptr for the callback */
struct pollfd *fd; /**< sysfs gpio fd */
} async_read_t;

View File

@ -589,7 +589,7 @@ static int _config_phy(ieee802154_dev_t *dev, const ieee802154_phy_conf_t *conf)
/* The value of this register represents the frequency offset (in MHz) from
* 2400 MHz. Channel 11 (first 2.4 GHz band channel) starts at 2405 MHz
* and all channels have a bandwidth of 5 MHz. Thus, we substract 10 to the
* and all channels have a bandwidth of 5 MHz. Thus, we subtract 10 to the
* channel number and multiply by 5 to calculate the offset.
*/
NRF_RADIO->FREQUENCY = (((uint8_t) conf->channel) - 10) * 5;

View File

@ -40,7 +40,7 @@
* ```
*
* This switches the GPIO reads to use the Cortex-M0+ single-cycle I/O port
* instead of the regular APB acces. The single-cycle I/O port is always used
* instead of the regular APB access. The single-cycle I/O port is always used
* for writes when it is available on the device.
*
* @}

View File

@ -145,7 +145,7 @@ int timer_init(tim_t tim, unsigned long freq, timer_cb_t cb, void *arg)
return -1;
}
/* make sure the prescaler is withing range */
/* make sure the prescaler is within range */
if (scale > TC_CTRLA_PRESCALER_DIV1024_Val) {
DEBUG("[timer %d] scale %d is out of range\n", tim, scale);
return -1;

View File

@ -16,3 +16,88 @@ dout
# ALS (Ambient Light Sensing) => ALSO
als
# Technik (From "Beuth Hochschule für Technik Berlin") => Technique
technik
# inout (Doxygen input/output param) => input, in out
inout
# OT (OpenThread) => TO, OF, OR
ot
# fo (fragment offset) => of, for
fo
# AACK (802.15.4 Auto ACK) => ACK
aack
# pres (variable used for pressure measurement) => press
pres
# tHW (concatenation of \t and HW) => the, thaw
thw
# tThe (concatenation of \t and The) => the
tthe
# HSI (High Speed Internal oscillator) => HIS
hsi
# hart (RISC-V hart) => heart, harm
hart
# produkt (used in an url) => product
produkt
# BORD (a define in arm7_common) => BOARD, BORED, BORDER
bord
# PTD (a define in kinetis) => PDF
ptd
# THRE (a register of AVR UART peripheral) => THREE, THERE, THEIR, THE
thre
# UE (a register of AVR UART peripheral) => USE, DUE
ue
# BA (an hexadecimal value in tests-hashes-sha1.c) => BY, BE
ba
# doesnt (used in a test string in tests-crypto-modes-ccm.c) => doesn't, does not
doesnt
# creat (a POSIX fnctl function name) => create
creat
# Manal (firstname of a contributor) => Manual
manal
# ths (a variable name in thread_cooperation/main.c) => the, this
ths
# te, hel (partial words used in shell test script) => the, be, help, hell, heal
te
hel
# GUAs (Global Unicast Address) => gauss
guas
# extint (variable for external interrupt) => extinct, extant
extint
# ser (variable name in espreset.py script) => set
ser
# keypair (function name used in qdsa test) => key pair
keypair
# comprE (RPL number of prefix octets) => compare, compère
compre
# files' (when files is the last word in string, between quotes) => file's
files'
# dedup (used in a GNRC header file name) => dedupe
dedup

View File

@ -54,7 +54,7 @@ class MainArgumentParser(object):
# create_parser.add_argument('-v', '--manifest-version', choices=['1'], default='1')
create_parser.add_argument('-i', '--input-file', metavar='FILE', type=argparse.FileType('r'),
help='An input file describing the update. The file must be formated as JSON. The overal structure is described in README.')
help='An input file describing the update. The file must be formatted as JSON. The overal structure is described in README.')
create_parser.add_argument('-o', '--output-file', metavar='FILE', type=argparse.FileType('wb'), required=True)
create_parser.add_argument('-f', '--format', metavar='FMT', choices=['suit', 'suit-debug', 'json'], default='suit')
create_parser.add_argument('-s', '--severable', action='store_true', help='Convert large elements to severable fields.')

View File

@ -373,7 +373,6 @@ def compile_manifest(options, m):
'command-arg' : None
}))
else:
te = []
for c in bootable_components:
pass
# TODO: conditions

View File

@ -177,7 +177,7 @@ Documentation:
This is a simpler approach to the above mentioned issue. The solution here only
uses a makefile script for selecting the debugger and serial port. No
adminstrative privileges (e.g. to configure Udev) are required.
administrative privileges (e.g. to configure Udev) are required.
One of the limitations of the solution described here is that it currently
doesn't work with multiple boards of the same type. This limitation is a

View File

@ -100,7 +100,7 @@ The integration of Kconfig into the build system is mainly done in
## Steps during the build process {#kconfig-steps-build-process}
![Ouput of every step of the build process](kconfig_integration.svg)
![Output of every step of the build process](kconfig_integration.svg)
### 0. Module dependency resolution
Currently, the resolution of module dependencies is performed by the build

View File

@ -832,7 +832,7 @@ static void _isr(netdev_t *netdev)
*/
#if AT86RF2XX_HAVE_RETRIES
ISR(TRX24_TX_START_vect){
/* __enter_isr(); is not neccessary as there is nothing which causes a
/* __enter_isr(); is not necessary as there is nothing which causes a
* thread_yield and the interrupt can not be interrupted by an other ISR */
at86rf2xx_t *dev = (at86rf2xx_t *) at86rfmega_dev;

View File

@ -83,7 +83,7 @@
* @brief Maximum transmission time
*
* The time in us that is required to send an Ethernet frame of maximum length
* (Preamle + SFD + 1518 byte) at 10 Mbps in full duplex mode with a guard
* (Preamble + SFD + 1518 byte) at 10 Mbps in full duplex mode with a guard
* period of 9,6 us. This time is used as time out for send operations.
*/
#define MAX_TX_TIME (1230U)

View File

@ -32,7 +32,7 @@
* application. This allows to @ref at_add_urc "register" and
* @ref at_remove_urc "de-register" URC strings to check. Later,
* @ref at_process_urc can be called to check if any of the registered URCs have
* been detected. If a registered URC has been detected the correspondant
* been detected. If a registered URC has been detected the correspondent
* @ref at_urc_t::cb "callback function" is called. The mode of operation
* requires that the user of the module processes periodically the URCs.
*

View File

@ -53,7 +53,7 @@
* low.
*
* For all enabled channels (1 <= i <= INA3221_NUM_CH),
* the time to complete a full measurment cycle is:
* the time to complete a full measurement cycle is:
*
* num_samples * (shunt_conv_time_ch_i + bus_voltage_conv_time_ch_i)
*
@ -369,7 +369,7 @@ int _ina3221_enable_alert(ina3221_t *dev, ina3221_alert_t alert,
/**
* @brief Wrapper around @see _ina3221_enable_alert, to
* enble warning alert
* enable warning alert
*
* @param[in,out] dev Device handle
* @param[in] cb Alert callback

View File

@ -311,7 +311,7 @@ void lc709203f_set_rsoc_initial(const lc709203f_t *dev);
* @param[in] *dev pointer to lc709203f_t struct containing the i2c device and the address
* @param[in] value temp in 0.1K 0xAAC=0°C
*
* @return LC709203F_CELL_TEMP_INVALID Invlid cell temp
* @return LC709203F_CELL_TEMP_INVALID Invalid cell temp
*/
int8_t lc709203f_set_cell_temp(const lc709203f_t *dev, const unsigned int value);

View File

@ -153,7 +153,7 @@ typedef struct {
/**
* @brief Pin indicating (dis-)charging, labeled POL
*
* Set this pin to `GPIO_UNDEF` to tread every pulse as discharging. This
* Set this pin to `GPIO_UNDEF` to treat every pulse as discharging. This
* pin is pulled low by the LTC4150 in case the battery is discharging.
*/
gpio_t polarity;

View File

@ -197,7 +197,7 @@ int gpio_init_int(gpio_t pin, gpio_mode_t mode, gpio_flank_t flank,
/**
* @brief Enable pin interrupt if configured as interrupt source
*
* Interrupts that would have occured after @see gpio_irq_disable
* Interrupts that would have occurred after @see gpio_irq_disable
* was called will be discarded.
*
* @note You have to add the module `periph_gpio_irq` to your project to

View File

@ -123,7 +123,7 @@ pir_event_t pir_get_status(const pir_t *dev);
int pir_get_occupancy(pir_t *dev, int16_t *occup);
/**
* @brief Register a thread for notification whan state changes on the
* @brief Register a thread for notification when state changes on the
* motion sensor.
*
* @note

View File

@ -31,7 +31,7 @@
#define min(a, b) ((a) > (b) ? (b) : (a))
/* MCI driver only suports whole page reads / writes */
/* MCI driver only supports whole page reads / writes */
static uint8_t _page_buffer[SD_HC_BLOCK_SIZE];
static int mtd_mci_init(mtd_dev_t *dev)

View File

@ -121,7 +121,7 @@ enum {
typedef enum {
NIMBLE_NETIF_ACCEPTING, /**< accepting incoming connections */
NIMBLE_NETIF_ACCEPT_STOP, /**< stop accepting incoming connections */
NIMBLE_NETIF_INIT_MASTER, /**< conn. procedure started (as mater) */
NIMBLE_NETIF_INIT_MASTER, /**< conn. procedure started (as master) */
NIMBLE_NETIF_INIT_SLAVE, /**< conn. procedure started (as slave) */
NIMBLE_NETIF_CONNECTED_MASTER, /**< connection established as master */
NIMBLE_NETIF_CONNECTED_SLAVE, /**< connection established as slave */

View File

@ -1,4 +1,4 @@
This README contains information how to establish an IPv6 connecton between
This README contains information how to establish an IPv6 connection between
Linux BLE router and an IPSP enabled BLE device.
Prerequisites

View File

@ -183,7 +183,7 @@ extern "C" {
#define CONFIG_LWM2M_DEVICE_BINDING_US
/**
* @brief UDP and SMS bindins with Queue mode
* @brief UDP and SMS bindings with Queue mode
*/
#define CONFIG_LWM2M_DEVICE_BINDING_UQS
#endif

View File

@ -1982,8 +1982,8 @@ API Changes
- static inline int ipv6_addr_split_iface(char *addr_str)
+ static inline char *ipv6_addr_split_iface(char *addr_str)
- int ipv6_addr_split(char *addr_str, char seperator, int _default);
+ int ipv6_addr_split_int(char *addr_str, char seperator, int _default);
- int ipv6_addr_split(char *addr_str, char separator, int _default);
+ int ipv6_addr_split_int(char *addr_str, char separator, int _default);
+ char *ipv6_addr_split_str(char *addr_str, char separator);
/* change address getter and setter functions to avoid byte order confusion */
@ -2857,7 +2857,7 @@ Networking
* gnrc_ipv6_nib: add address from netif to address validation timer
+ netdev_ieee802154: add txpower and page
+ net/lorawan/hdr: add lorawan header helpers
+ ble/nimble: add support for build-in IPSS service
+ ble/nimble: add support for built-in IPSS service
* pkg/semtech-loramac: rework interaction with the MAC
* pkg/semtech-loramac: provide basic persistence for MAC state
* RPL: API update suggestions
@ -3082,7 +3082,7 @@ Networking related issues
#11859: examples: dtls-echo fails silently when DTLS_ECC flag enabled
#11519: shell/ping6: Incorrect handling of unexpected pongs
#11405: nrfmin: communication not possible after multicast ping with no interval
#11390: gnrc networking crashs on nRF51dk
#11390: gnrc networking crashes on nRF51dk
#11212: POSIX sockets + lwIP: bad file descriptor
#11033: 6lo: RIOT does not receive packets from Linux when short_addr is set
#10969: net: netdev_driver_t::send() doc unclear
@ -4309,7 +4309,7 @@ Networking related issues
#7474: 6lo: gnrc fragmentation expects driver to block on TX
#7737: pkg: libcoap is partially broken and outdated
#8086: gnrc_rpl_p2p: not compiling
#8130: gcoap: can't build witth network stacks other than gnrc
#8130: gcoap: can't build with network stacks other than gnrc
#8172: gnrc_netif, gnrc_uhcpc: Replacing prefix on border router results in no
configured prefix
#8271: app/netdev: application stops working after receiving frames with
@ -4401,7 +4401,7 @@ Fixed Issues from the last release (2018.07)
#9573: pkg/lwip: assert on samr21-xpro
#9584: drivers/cc2420: add netopt NETOPT_MAX_PACKET_SIZE
#6437: periph/spi: Leftovers from SPI rework in #4780
#6650: GPIO Port shift in cc2538 is unconsistent
#6650: GPIO Port shift in cc2538 is inconsistent
#6836: Issuing a reboot on ATmega328p makes the board loop-reboot
#7846: stm32f1: I2C read functions return bogus values with unconnected devices
#9616: at86rf2xx: can not correctly set channel after `NETOPT_STATE_RESET`
@ -4602,7 +4602,7 @@ Networking related issues
#7474: 6lo: gnrc fragmentation expects driver to block on TX
#7737: pkg: libcoap is partially broken and outdated
#8086: gnrc_rpl_p2p: not compiling
#8130: gcoap: can't build witth network stacks other than gnrc
#8130: gcoap: can't build with network stacks other than gnrc
#8172: gnrc_netif, gnrc_uhcpc: Replacing prefix on border router results in no
configured prefix
#8271: app/netdev: application stops working after receiving frames with
@ -4651,7 +4651,7 @@ Other platforms related issues
#6437: periph/spi: Leftovers from SPI rework in #4780
#6567: periph/spi: Switching between CPOL=0,1 problems on Kinetis with software
CS
#6650: GPIO Port shift in cc2538 is unconsistent
#6650: GPIO Port shift in cc2538 is inconsistent
#6838: Issuing a reboot on ATmega328p makes the board loop-reboot
#6874: SAMD21: possible CMSIS bug
#7020: isr_rfcoreerrors while pinging between CC2538DKs
@ -5201,7 +5201,7 @@ Networking related issues
network interfaces need to get unlocked in the current implementation to not get deadlocked.
Recursive mutexes as provided in #5731 might help to solve this problem.
#5748: gnrc: nodes crashing with too small packet buffer: A packet buffer of size ~512 B might lead
to crashes. The issue describes this for several hundret nodes, but agressive flooding with
to crashes. The issue describes this for several hundred nodes, but aggressive flooding with
just two nodes was also shown to lead to this problem.
#5858: gnrc: 6lo: potential problem with reassembly of fragments: If one frame gets lost the reassembly
state machine might get out of sync
@ -5258,7 +5258,7 @@ other platform related issues
some pin configurations might get lost.
#5009: RIOT is saw-toothing in energy consumption (even when idling)
#5103: xtimer: weird behavior of tests/xtimer_drift: xtimer_drift randomly jumps a few seconds on nrf52
#5405: Eratic timings on iotlab-m3 with compression context activated
#5405: Erratic timings on iotlab-m3 with compression context activated
#5486: at86rf2xx: lost interrupts
#5678: at86rf2xx: failed assertion in _isr
#5944: msp430: ipv6_hdr unittests fail
@ -5689,7 +5689,7 @@ Drivers
+ SD Card driver (SPI)
+ NXP PN532 NFC driver
+ Initial (experimental) Microchip MRF24J40 radio driver
+ JEDEC JC42.4 temperatur sensors
+ JEDEC JC42.4 temperature sensors
+ Bosch BME280 pressure, humidity and temperature sensor
* NXP MMA8x5x accelerometer (previously MMA8652)
* Unified STM32 RTC driver
@ -5741,7 +5741,7 @@ Networking related issues
network interfaces need to get unlocked in the current implementation to not get deadlocked.
Recursive mutexes as provided in #5731 might help to solve this problem.
#5748: gnrc: nodes crashing with too small packet buffer: A packet buffer of size ~512 B might lead
to crashes. The issue describes this for several hundret nodes, but agressive flooding with
to crashes. The issue describes this for several hundred nodes, but aggressive flooding with
just two nodes was also shown to lead to this problem.
#5858: gnrc: 6lo: potential problem with reassembly of fragments: If one frame gets lost the reassembly
state machine might get out of sync
@ -5808,7 +5808,7 @@ other platform related issues
#5009: RIOT is saw-toothing in energy consumption (even when idling)
#5103: xtimer: weird behavior of tests/xtimer_drift: xtimer_drift randomly jumps a few seconds on nrf52
#5361: cpu/cc26x0: timer broken
#5405: Eratic timings on iotlab-m3 with compression context activated
#5405: Erratic timings on iotlab-m3 with compression context activated
#5460: cpu/samd21: i2c timing with compiler optimization
#5486: at86rf2xx: lost interrupts
#5489: cpu/lpc11u34: ADC broken
@ -6041,7 +6041,7 @@ Networking related issues
provided in #5731 might help to solve this problem.
#5748: gnrc: nodes crashing with too small packet buffer: A packet buffer of
size ~512 B might lead to crashes. The issue describes this for several
hundret nodes, but agressive flooding with just two nodes was also
hundred nodes, but aggressive flooding with just two nodes was also
shown to lead to this problem.
#5858: gnrc: 6lo: potential problem with reassembly of fragments: If one frame
gets lost the reassembly state machine might get out of sync
@ -6091,7 +6091,7 @@ native related issues
other platform related issues
-----------------------------
#1891: newlib-nano: Printf formatting does not work properly for some numberic
#1891: newlib-nano: Printf formatting does not work properly for some numeric
types: PRI[uxdi]64, PRI[uxdi]8 and float are not parsed in newlib-nano
#2006: cpu/nrf51822: timer callback may be fired too early
#2143: unittests: tests-core doesn't compile for all platforms: GCC build-ins
@ -6113,7 +6113,7 @@ other platform related issues
#5103: xtimer: weird behavior of tests/xtimer_drift: xtimer_drift randomly
jumps a few seconds on nrf52
#5361: cpu/cc26x0: timer broken
#5405: Eratic timings on iotlab-m3 with compression context activated
#5405: Erratic timings on iotlab-m3 with compression context activated
#5460: cpu/samd21: i2c timing with compiler optimization
#5486: at86rf2xx: lost interrupts
#5489: cpu/lpc11u34: ADC broken
@ -6489,7 +6489,7 @@ Drivers
+ AES encryption for xbee radio driver
+ added ADC mapping to SAUL
Sytem libraries
System libraries
---
- vtimer support was dropped completely and removed
@ -7337,7 +7337,7 @@ other issues:
--------------
#1449: a removed vtimer might still get called back by hwtimer
The timer callback might still fire even after vtimer_remove() was called.
#2175: valgrind registeres "Invalid write of size 4" in unittests for ubjson
#2175: valgrind registers "Invalid write of size 4" in unittests for ubjson
According to valgrind the stack gets corrupted in UBJSON.
For all issues and open pull requests please check the RIOT issue tracker:

View File

@ -75,7 +75,7 @@ class TwoWire
static uint8_t rxBufferIndex; /**< index for RX buffer read */
static uint8_t rxBufferLength; /**< number of bytes in RX buffer */
static uint8_t txAddress; /**< adress for transfer */
static uint8_t txAddress; /**< address for transfer */
static uint8_t txBuffer[]; /**< TX buffer */
static uint8_t txBufferIndex; /**< index for TX buffer write */
static uint8_t txBufferLength; /**< number of bytes in TX buffer */

View File

@ -503,7 +503,7 @@ int can_device_calc_bittiming(uint32_t clock, const struct can_bittiming_const *
tseg >= timing_const->tseg1_min + timing_const->tseg2_min; tseg--) {
uint32_t nbt = tseg + CAN_SYNC_SEG;
/* theoritical brp */
/* theoretical brp */
uint32_t brp = clock / (timing->bitrate * nbt);
/* brp according to brp_inc */
brp = (brp / timing_const->brp_inc) * timing_const->brp_inc;

View File

@ -76,7 +76,7 @@ extern "C" {
#endif
/**
* @brief Per-Interface Event Message Busses
* @brief Per-Interface Event Message Buses
*/
typedef enum {
#ifdef MODULE_GNRC_IPV6

View File

@ -45,7 +45,7 @@ typedef struct {
uint8_t datarate; /**< LoRaWAN datarate for the next transmission */
uint8_t port; /**< LoRaWAN port for the next transmission */
uint8_t ack_req; /**< Request ACK in the next transmission */
uint8_t otaa; /**< wether the next transmission is OTAA or not */
uint8_t otaa; /**< whether the next transmission is OTAA or not */
} gnrc_netif_lorawan_t;
#ifdef __cplusplus

View File

@ -58,7 +58,7 @@ typedef struct {
* @param[in] addr Address for endpoint.
* @param[in] addr_size Size of @p addr.
* @param[in] port Port number for endpoint.
* @param[in] netif Network inferface to use.
* @param[in] netif Network interface to use.
*
* @return 0 on success.
* @return -EAFNOSUPPORT if @p address_family is not supported.

View File

@ -410,7 +410,7 @@ static inline bool xtimer_less64(xtimer_ticks64_t a, xtimer_ticks64_t b);
* @param[in] us timeout in microseconds relative
*
* @return 0, when returned after mutex was locked
* @return -1, when the timeout occcured
* @return -1, when the timeout occurred
*/
int xtimer_mutex_lock_timeout(mutex_t *mutex, uint64_t us);
@ -421,7 +421,7 @@ int xtimer_mutex_lock_timeout(mutex_t *mutex, uint64_t us);
* @param[in] us timeout in microseconds relative
*
* @return 0, when returned after rmutex was locked
* @return -1, when the timeout occcured
* @return -1, when the timeout occurred
*/
int xtimer_rmutex_lock_timeout(rmutex_t *rmutex, uint64_t us);

View File

@ -12,7 +12,7 @@
* @brief Provides 32bit -> 16bit pointer compression
*
* On many platforms, some pointers may have to be aligned, e.g., to 4 byte
* bounderies.
* boundaries.
* On 32bit platforms, that makes it possible to store all possible aligned
* 32bit pointers in a 16bit value as long as the total memory is small (e.g.,
* with 4 byte alignment, all pointers within 256kb RAM can be represented by a
@ -83,7 +83,7 @@ typedef uint16_t zptr_t;
#define ZPTR_MAX_ADDR ((uintptr_t)ZPTR_BASE + (1 << 18))
/**
* @brief Determine if a pointer is compressable by zptrc()
* @brief Determine if a pointer is compressible by zptrc()
* @param[in] pointer pointer to check
* @returns 1 if pointer can be compressed, 0 if not
*/
@ -98,7 +98,7 @@ static inline int zptr_check(void *pointer)
/**
* @brief Compress a pointer (if possible)
*
* Substracts ZPTR_BASE, then right-shifts @p pointer by two.
* Subtracts ZPTR_BASE, then right-shifts @p pointer by two.
*
* @param[in] pointer pointer to compress
* @returns compressed pointer

View File

@ -234,7 +234,7 @@ void _handle_snd_ns(_nib_onl_entry_t *nbr)
/* intentionally falls through */
case GNRC_IPV6_NIB_NC_INFO_NUD_STATE_UNREACHABLE:
if (!IS_ACTIVE(CONFIG_GNRC_IPV6_NIB_6LR) ||
/* if neighbor is a 6LoWPAN node (i.e. address registartion
/* if neighbor is a 6LoWPAN node (i.e. address registration
* state is non-garbage-collectible), only probe if it is a
* router (where the solicited-nodes multicast address MUST
* be set; only MAY otherwise).

View File

@ -148,7 +148,7 @@ static uint16_t _send_1st_fragment(gnrc_netif_t *iface,
* datagram_size: size of the uncompressed IPv6 packet */
int payload_diff = _payload_diff(fbuf, payload_len);
uint16_t local_offset;
/* virtually add payload_diff to flooring to account for offset (must be divisable by 8)
/* virtually add payload_diff to flooring to account for offset (must be dividable by 8)
* in uncompressed datagram */
uint16_t max_frag_size = _floor8(_max_frag_size(iface, fbuf) +
payload_diff - sizeof(sixlowpan_frag_t)) -

View File

@ -306,7 +306,7 @@ static int _fsm_call_recv(gnrc_tcp_tcb_t *tcb, void *buf, size_t len)
if (ringbuffer_get_free(&tcb->rcv_buf) >= CONFIG_GNRC_TCP_MSS) {
tcb->rcv_wnd = ringbuffer_get_free(&(tcb->rcv_buf));
/* Send ACK to anounce window update */
/* Send ACK to announce window update */
gnrc_pktsnip_t *out_pkt = NULL;
uint16_t seq_con = 0;
_pkt_build(tcb, &out_pkt, &seq_con, MSK_ACK, tcb->snd_nxt, tcb->rcv_nxt, NULL, 0);

View File

@ -182,7 +182,7 @@ void __pthread_keys_exit(int self_id)
{
tls_data_t **tls = __pthread_get_tls_head(self_id);
/* Calling the dtor could cause another pthread_exit(), so we dehead and free defore calling it. */
/* Calling the dtor could cause another pthread_exit(), so we dehead and free before calling it. */
mutex_lock(&tls_mutex);
for (tls_data_t *specific; (specific = *tls); ) {
*tls = specific->next;

View File

@ -189,7 +189,7 @@ int _sht_config_handler(int argc, char **argv)
"\n"
" -r l/h\n"
" Set resolution to low/high. Low resolution trades "
"presicion for speed\n"
"precision for speed\n"
"\n"
" -H y/n\n"
" Turns heater on/off. Can increase temperature by up to "

View File

@ -13,7 +13,7 @@
* @{
*
* @file
* @brief ztimer core functinality
* @brief ztimer core functionality
*
* This file contains ztimer's main API implementation and functionality
* present in all ztimer clocks (most notably multiplexing ant extension).

View File

@ -14,7 +14,7 @@ actually triggers.
### set() one
This repeatedly sets one timer in an otherwise emtpy list.
This repeatedly sets one timer in an otherwise empty list.
All but the first iteration will cause xtimer to implicitly remove the timer
first.
All iterations will cause the underlying periph timer to be updated.

View File

@ -27,7 +27,7 @@
#include "ina3221_params.h"
#include "ina3221.h"
/* Issue critical alert if shunt voltage is above thist value */
/* Issue critical alert if shunt voltage is above this value */
#define CRIT_ALERT_LIM_UV (2500)
/* Issue warning alert if shunt voltage is above this value */
#define WARN_ALERT_LIM_UV (1600)

View File

@ -22,7 +22,7 @@ frames to properly communicate over the TAP interface.
The tests succeeds if you see the string `SUCCESS`.
If any problems are encountered (i.e. if the test prints the sting `FAILED`),
If any problems are encountered (i.e. if the test prints the string `FAILED`),
set the echo parameter in the `run()` function at the bottom of the test script
(tests/01-run.py) to `True`. The test script will then offer a more detailed
output.

View File

@ -24,7 +24,7 @@ frames to properly communicate over the TAP interface.
The tests succeeds if you see the string `SUCCESS`.
If any problems are encountered (i.e. if the test prints the sting `FAILED`),
If any problems are encountered (i.e. if the test prints the string `FAILED`),
set the echo parameter in the `run()` function at the bottom of the test script
(tests/01-run.py) to `True`. The test script will then offer a more detailed
output.

View File

@ -24,7 +24,7 @@ frames to properly communicate over the TAP interface.
The tests succeeds if you see the string `SUCCESS`.
If any problems are encountered (i.e. if the test prints the sting `FAILED`),
If any problems are encountered (i.e. if the test prints the string `FAILED`),
set the echo parameter in the `run()` function at the bottom of the test script
(tests/01-run.py) to `True`. The test script will then offer a more detailed
output.

View File

@ -25,7 +25,7 @@ frames to properly communicate over the TAP interface.
The tests succeeds if you see the string `SUCCESS`.
If any problems are encountered (i.e. if the test prints the sting `FAILED`),
If any problems are encountered (i.e. if the test prints the string `FAILED`),
set the echo parameter in the `run()` function at the bottom of the test script
(tests/01-run.py) to `True`. The test script will then offer a more detailed
output.

View File

@ -22,7 +22,7 @@ frames to properly communicate over the TAP interface.
The tests succeeds if you see the string `SUCCESS`.
If any problems are encountered (i.e. if the test prints the sting `FAILED`),
If any problems are encountered (i.e. if the test prints the string `FAILED`),
set the echo parameter in the `run()` function at the bottom of the test script
(tests/01-run.py) to `True`. The test script will then offer a more detailed
output.

View File

@ -29,7 +29,7 @@ static const char long_str[] = "\xff,a\xff.bcdefghijklmnop";
int main(void)
{
/* test data width vs. output width discrepency */
/* test data width vs. output width discrepancy */
CALL(od_hex_dump(short_str, sizeof(short_str), OD_WIDTH_DEFAULT));
/* Test different output width in default configuration*/

View File

@ -42,7 +42,7 @@
#define ARG_ERROR (-1)
/* i2c_buf is global to reduce stack memory consumtion */
/* i2c_buf is global to reduce stack memory consumption */
static uint8_t i2c_buf[BUFSIZE];
static inline void _print_i2c_read(i2c_t dev, uint16_t *reg, uint8_t *buf,

View File

@ -892,7 +892,7 @@ static const size_t TEST_WYCHEPROOF_28_EXPECTED_LEN = 63;
/* Manually created test vectors */
/* This is neccessary, because no test vectors are published with input length > 256 */
/* This is necessary, because no test vectors are published with input length > 256 */
/* Data has been verified against BouncyCastle (.NET Core) and pycryptodome */
static const uint8_t TEST_MANUAL_01_KEY[] = {