From 4a31f94cfc82cc33ac27b41ab8c68dc03583e7c2 Mon Sep 17 00:00:00 2001 From: Francois Berder <18538310+francois-berder@users.noreply.github.com> Date: Sat, 14 Sep 2019 14:47:10 +0100 Subject: [PATCH] many typo fixes Signed-off-by: Francois Berder <18538310+francois-berder@users.noreply.github.com> --- core/include/byteorder.h | 2 +- core/include/thread.h | 4 +-- core/rmutex.c | 4 +-- cpu/atmega_common/thread_arch.c | 2 +- cpu/cc2538/periph/adc.c | 4 +-- cpu/cc2538/periph/timer.c | 2 +- cpu/cortexm_common/cortexm_init.c | 4 +-- cpu/efm32/periph/i2c.c | 4 +-- cpu/esp32/cxx/cxa_guard.cpp | 2 +- cpu/esp32/ld/esp32.common.ld | 2 +- cpu/esp32/periph/i2c_sw.c | 2 +- cpu/esp32/periph/pwm.c | 8 +++--- cpu/esp32/periph/rtc.c | 4 +-- cpu/esp32/periph/spi.c | 4 +-- cpu/esp32/periph/timer.c | 2 +- cpu/esp32/startup.c | 2 +- cpu/esp32/syscalls.c | 4 +-- cpu/esp32/thread_arch.c | 2 +- cpu/esp_common/esp-now/esp_now_netdev.h | 2 +- cpu/fe310/periph/gpio.c | 6 ++--- cpu/kinetis/dist/check-fcfield.sh | 2 +- cpu/kinetis/include/vectors_kinetis.h | 2 +- cpu/kinetis/vectors.c | 2 +- cpu/lm4f120/periph/uart.c | 2 +- cpu/lpc2387/lpc23xx-iap.c | 4 +-- cpu/lpc2387/mci/lpc2387-mci.c | 14 +++++----- cpu/lpc2387/periph/rtc.c | 2 +- .../newlib_syscalls_mips_uhi/syscalls.c | 4 +-- cpu/mips32r2_common/periph/pm.c | 2 +- cpu/mips32r2_common/thread_arch.c | 6 ++--- cpu/mips_pic32_common/reset_mod.S | 2 +- cpu/msp430_common/include/sys/cdefs.h | 2 +- cpu/msp430_common/include/sys/features.h | 2 +- cpu/native/socket_zep/socket_zep.c | 2 +- cpu/nrf51/periph/pwm.c | 2 +- cpu/nrf52/periph/i2c.c | 2 +- cpu/nrf52/radio/nrf802154/nrf802154.c | 2 +- cpu/nrf5x_common/radio/nrfble/nrfble.c | 2 +- cpu/nrf5x_common/radio/nrfmin/nrfmin.c | 2 +- cpu/sam0_common/periph/rtc.c | 2 +- cpu/sam0_common/periph/timer.c | 2 +- cpu/sam3/periph/cpuid.c | 2 +- cpu/samd21/cpu.c | 2 +- cpu/stm32_common/include/periph_cpu_common.h | 2 +- cpu/stm32_common/periph/i2c_1.c | 4 +-- cpu/stm32_common/periph/i2c_2.c | 2 +- cpu/stm32_common/periph/qdec.c | 2 +- cpu/stm32f1/periph/rtt.c | 4 +-- cpu/stm32l4/periph/adc.c | 2 +- dist/tools/coccinelle/README.md | 2 +- dist/tools/goodfet/goodfet.bsl | 8 +++--- dist/tools/tunslip/tunslip.c | 2 +- doc/doxygen/riot.doxyfile | 2 +- drivers/ad7746/ad7746.c | 6 ++--- drivers/ads101x/ads101x.c | 4 +-- drivers/bmx055/bmx055.c | 2 +- drivers/ccs811/ccs811.c | 4 +-- drivers/ccs811/doc.txt | 2 +- drivers/ccs811/include/ccs811_regs.h | 2 +- drivers/dynamixel/include/dynamixel_reader.h | 2 +- drivers/dynamixel/include/dynamixel_writer.h | 2 +- drivers/enc28j60/enc28j60.c | 6 ++--- .../encx24j600/include/encx24j600_internal.h | 2 +- drivers/feetech/include/feetech_reader.h | 6 ++--- drivers/feetech/include/feetech_writer.h | 2 +- drivers/include/ad7746.h | 4 +-- drivers/include/at30tse75x.h | 2 +- drivers/include/bmp180.h | 2 +- drivers/include/diskio.h | 2 +- drivers/include/ds18.h | 2 +- drivers/include/ds75lx.h | 8 +++--- drivers/include/dsp0401.h | 8 +++--- drivers/include/io1_xplained.h | 2 +- drivers/include/mtd.h | 16 ++++++------ drivers/include/net/netdev/ieee802154.h | 8 +++--- drivers/include/nrf24l01p.h | 4 +-- drivers/include/periph/gpio_util.h | 2 +- drivers/include/periph/hwrng.h | 2 +- drivers/include/rn2xx3.h | 8 +++--- drivers/include/sdcard_spi.h | 16 ++++++------ drivers/include/sds011.h | 20 +++++++------- drivers/include/si70xx.h | 2 +- drivers/kw2xrf/include/kw2xrf_getset.h | 6 ++--- drivers/lis3mdl/include/lis3mdl-internal.h | 2 +- drivers/mrf24j40/include/mrf24j40_internal.h | 2 +- drivers/mrf24j40/mrf24j40_netdev.c | 4 +-- drivers/nrf24l01p/nrf24l01p.c | 4 +-- drivers/periph_common/i2c.c | 4 +-- .../sdcard_spi/include/sdcard_spi_internal.h | 8 +++--- drivers/sdcard_spi/sdcard_spi.c | 6 ++--- drivers/sht3x/sht3x.c | 4 +-- drivers/sx127x/sx127x_getset.c | 2 +- .../include/uart_half_duplex.h | 2 +- examples/emcute_mqttsn/README.md | 2 +- examples/gnrc_tftp/tftp_client.c | 2 +- examples/gnrc_tftp/tftp_server.c | 2 +- makefiles/buildtests.inc.mk | 2 +- sys/arduino/sketches.inc.mk | 2 +- sys/bitfield/bitfield.c | 2 +- .../include/riot/detail/thread_util.hpp | 6 ++--- sys/crypto/modes/ocb.c | 4 +-- sys/include/bloom.h | 2 +- sys/include/can/doc.txt | 2 +- sys/include/can/isotp.h | 2 +- sys/include/can/pkt.h | 6 ++--- sys/include/crypto/ciphers.h | 2 +- sys/include/iolist.h | 2 +- sys/include/irq_handler.h | 8 +++--- sys/include/net/cord/ep_standalone.h | 2 +- sys/include/net/csma_sender.h | 4 +-- sys/include/net/eui64.h | 2 +- sys/include/net/gnrc/ipv6/nib.h | 2 +- sys/include/net/gnrc/ndp.h | 2 +- sys/include/net/gnrc/neterr.h | 2 +- sys/include/net/gnrc/pkt.h | 2 +- sys/include/net/gnrc/rpl.h | 8 +++--- sys/include/net/gnrc/tcp.h | 10 +++---- sys/include/net/gnrc/tftp.h | 2 +- sys/include/net/ieee802154.h | 2 +- sys/include/net/nanocoap.h | 4 +-- sys/include/net/ppp/hdr.h | 2 +- sys/include/net/sixlowpan.h | 2 +- sys/include/net/sock.h | 2 +- sys/include/universal_address.h | 2 +- sys/include/xtimer.h | 2 +- .../gnrc/application_layer/tftp/gnrc_tftp.c | 2 +- sys/net/gnrc/link_layer/lwmac/lwmac.c | 6 ++--- .../network_layer/ipv6/nib/_nib-internal.h | 2 +- sys/net/gnrc/routing/rpl/srh/gnrc_rpl_srh.c | 2 +- sys/net/gnrc/transport_layer/tcp/gnrc_tcp.c | 14 +++++----- .../transport_layer/tcp/gnrc_tcp_eventloop.c | 8 +++--- .../gnrc/transport_layer/tcp/gnrc_tcp_fsm.c | 26 +++++++++---------- .../gnrc/transport_layer/tcp/gnrc_tcp_pkt.c | 4 +-- .../transport_layer/tcp/internal/common.h | 2 +- .../gnrc/transport_layer/tcp/internal/fsm.h | 2 +- .../gnrc/transport_layer/tcp/internal/pkt.h | 6 ++--- sys/net/routing/nhdp/iib_table.c | 2 +- .../pthread/include/pthread_rwlock_attr.h | 2 +- sys/posix/pthread/pthread_rwlock.c | 2 +- sys/random/fortuna/fortuna.h | 2 +- sys/shell/commands/sc_fib.c | 2 +- sys/shell/commands/sc_vfs.c | 2 +- tests/cortexm_common_ldscript/Makefile | 2 +- tests/cortexm_common_ldscript/README.md | 4 +-- tests/driver_io1_xplained/main.c | 2 +- tests/driver_lc709203f/main.c | 2 +- tests/driver_lis2dh12/main.c | 2 +- tests/driver_sds011/main.c | 2 +- tests/driver_srf08/main.c | 2 +- tests/driver_tps6274x/README.md | 2 +- tests/gnrc_sock_ip/stack.h | 2 +- tests/gnrc_sock_udp/stack.h | 2 +- tests/pkg_fatfs/README.md | 2 +- tests/pkg_fatfs_vfs/README.md | 2 +- tests/pkg_semtech-loramac/README.md | 4 +-- tests/pkg_tiny-asn1/README.md | 2 +- tests/pkg_tiny-asn1/main.c | 2 +- tests/riotboot/tests/common/assert_slotnum.py | 2 +- tests/rng/main.c | 2 +- tests/sys_irq_handler/main.c | 2 +- .../tests-gnrc_ipv6_nib-internal.c | 2 +- .../tests-inet_csum/tests-inet_csum.c | 2 +- tests/unittests/tests-pkt/tests-pkt.c | 2 +- tests/warn_conflict/README.md | 2 +- tests/xtimer_hang/README.md | 4 +-- tests/xtimer_mutex_lock_timeout/main.c | 2 +- 166 files changed, 296 insertions(+), 296 deletions(-) diff --git a/core/include/byteorder.h b/core/include/byteorder.h index 4052a56c24..fcd99ae8b4 100644 --- a/core/include/byteorder.h +++ b/core/include/byteorder.h @@ -367,7 +367,7 @@ static inline le_uint64_t byteorder_btolll(be_uint64_t v) } /** - * @brief Swaps the byteorder according to the endianess + * @brief Swaps the byteorder according to the endianness */ #if __BYTE_ORDER__ == __ORDER_LITTLE_ENDIAN__ # define _byteorder_swap(V, T) (byteorder_swap##T((V))) diff --git a/core/include/thread.h b/core/include/thread.h index b5139a61a4..eca0333598 100644 --- a/core/include/thread.h +++ b/core/include/thread.h @@ -348,10 +348,10 @@ kernel_pid_t thread_create(char *stack, const char *name); /** - * @brief Retreive a thread control block by PID. + * @brief Retrieve a thread control block by PID. * @details This is a bound-checked variant of accessing `sched_threads[pid]` directly. * If you know that the PID is valid, then don't use this function. - * @param[in] pid Thread to retreive. + * @param[in] pid Thread to retrieve. * @return `NULL` if the PID is invalid or there is no such thread. */ volatile thread_t *thread_get(kernel_pid_t pid); diff --git a/core/rmutex.c b/core/rmutex.c index 9438f74f8a..703e8c2527 100644 --- a/core/rmutex.c +++ b/core/rmutex.c @@ -51,7 +51,7 @@ static int _lock(rmutex_t *rmutex, int trylock) * mutex_lock(). However the read access to owner is not * locked, and owner can be changed by a thread that is * holding the lock (e.g.: holder unlocks the mutex, new - * holder aquired the lock). The atomic access strategy + * holder acquired the lock). The atomic access strategy * 'relaxed' ensures, that the value of rmutex->owner is read * consistent. * @@ -72,7 +72,7 @@ static int _lock(rmutex_t *rmutex, int trylock) * Note for Case 2: * * Because the mutex rmutex->owner is only written be the - * owner (me), rmutex->owner stays constant througout the + * owner (me), rmutex->owner stays constant throughout the * complete call and rmutex->refcount is protected * (read/write) by the mutex. */ diff --git a/cpu/atmega_common/thread_arch.c b/cpu/atmega_common/thread_arch.c index db9607d11f..fdbbf3587e 100644 --- a/cpu/atmega_common/thread_arch.c +++ b/cpu/atmega_common/thread_arch.c @@ -172,7 +172,7 @@ char *thread_stack_init(thread_task_func_t task_func, void *arg, * @brief thread_stack_print prints the stack to stdout. * It depends on getting the correct values for stack_start, stack_size and sp * from sched_active_thread. - * Maybe it would be good to change that to way that is less dependant on + * Maybe it would be good to change that to way that is less dependent on * getting correct values elsewhere (since it is a debugging tool and in the * presence of bugs the data may be corrupted). */ diff --git a/cpu/cc2538/periph/adc.c b/cpu/cc2538/periph/adc.c index db6ecb2f25..bff5f2d3ba 100644 --- a/cpu/cc2538/periph/adc.c +++ b/cpu/cc2538/periph/adc.c @@ -43,7 +43,7 @@ int adc_init(adc_t line) /* stop random number generator, and set STSEL = 1 */ soc_adc->ADCCON1 = (SOC_ADC_ADCCON1_STSEL_M | SOC_ADC_ADCCON1_RCTRL_M); - /* disable any DMA, continous ADC settings */ + /* disable any DMA, continuous ADC settings */ soc_adc->ADCCON2 = 0x0; /* configure ADC GPIO as analog input */ gpio_init(adc_config[line], GPIO_IN_ANALOG); @@ -79,7 +79,7 @@ int adc_sample(adc_t line, adc_res_t res) return -1; } /** - * @attention CC2538 ADC supports differential comparision of two analog + * @attention CC2538 ADC supports differential comparison of two analog * GPIO inputs, hence negative values are possible. RIOT currently allows * positive ADC output only. Thus, reduce shift by one to compensate and * get full value range according to ADC resolution. E.g. 10 Bit resultion diff --git a/cpu/cc2538/periph/timer.c b/cpu/cc2538/periph/timer.c index 2c41341232..6dfc377764 100644 --- a/cpu/cc2538/periph/timer.c +++ b/cpu/cc2538/periph/timer.c @@ -187,7 +187,7 @@ int timer_clear(tim_t tim, int channel) if ( (tim >= TIMER_NUMOF) || (channel >= (int)timer_config[tim].chn) ) { return -1; } - /* clear interupt flags */ + /* clear interrupt flags */ dev(tim)->IMR &= ~(chn_isr_cfg[channel].flag); return 0; diff --git a/cpu/cortexm_common/cortexm_init.c b/cpu/cortexm_common/cortexm_init.c index 26db85d6f1..55aeaa242f 100644 --- a/cpu/cortexm_common/cortexm_init.c +++ b/cpu/cortexm_common/cortexm_init.c @@ -93,7 +93,7 @@ bool cpu_check_address(volatile const char *address) *address; /* Check BFARVALID flag */ if ((SCB->CFSR & BFARVALID_MASK) != 0) { - /* Bus Fault occured reading the address */ + /* Bus Fault occurred reading the address */ is_valid = false; } @@ -110,7 +110,7 @@ bool cpu_check_address(volatile const char *address) __asm__ volatile ( "movs r5, #1 \n" /* R5 will be set to 0 by HardFault handler */ - /* to indicate HardFault has occured */ + /* to indicate HardFault has occurred */ "ldr r1, =0xDEADF00D \n" /* set magic number */ "ldr r2, =0xCAFEBABE \n" /* 2nd magic to be sure */ "ldrb r3, %1 \n" /* probe address */ diff --git a/cpu/efm32/periph/i2c.c b/cpu/efm32/periph/i2c.c index 8f7cf4dbe5..4ae8762823 100644 --- a/cpu/efm32/periph/i2c.c +++ b/cpu/efm32/periph/i2c.c @@ -191,7 +191,7 @@ int i2c_read_regs(i2c_t dev, uint16_t address, uint16_t reg, return -EOPNOTSUPP; } - /* Handle endianess of register if 16 bit */ + /* Handle endianness of register if 16 bit */ if (flags & I2C_REG16) { reg_end = htons(reg); /* Make sure register is in big-endian on I2C bus */ } @@ -237,7 +237,7 @@ int i2c_write_regs(i2c_t dev, uint16_t address, uint16_t reg, return -EOPNOTSUPP; } - /* Handle endianess of register if 16 bit */ + /* Handle endianness of register if 16 bit */ if (flags & I2C_REG16) { reg_end = htons(reg); /* Make sure register is in big-endian on I2C bus */ } diff --git a/cpu/esp32/cxx/cxa_guard.cpp b/cpu/esp32/cxx/cxa_guard.cpp index a18eb0f846..cbe8ed344f 100644 --- a/cpu/esp32/cxx/cxa_guard.cpp +++ b/cpu/esp32/cxx/cxa_guard.cpp @@ -75,7 +75,7 @@ namespace __cxxabiv1 assert(0); } - /* mark the initialization in process and aquire */ + /* mark the initialization in process and acquire */ _gt->pending = 1; critical_exit(); diff --git a/cpu/esp32/ld/esp32.common.ld b/cpu/esp32/ld/esp32.common.ld index 1514f23b46..0e543f7013 100644 --- a/cpu/esp32/ld/esp32.common.ld +++ b/cpu/esp32/ld/esp32.common.ld @@ -85,7 +85,7 @@ SECTIONS .iram0.text : { - /* Code marked as runnning out of IRAM */ + /* Code marked as running out of IRAM */ _iram_text_start = ABSOLUTE(.); *(.iram1 .iram1.*) diff --git a/cpu/esp32/periph/i2c_sw.c b/cpu/esp32/periph/i2c_sw.c index 568b004871..e3e0db4f40 100644 --- a/cpu/esp32/periph/i2c_sw.c +++ b/cpu/esp32/periph/i2c_sw.c @@ -472,7 +472,7 @@ static /* IRAM */ int _i2c_start_cond(_i2c_bus_t* bus) /* SDA = passive HIGH (floating and pulled-up) */ _i2c_sda_high (bus); - /* t_VD;DAT not neccessary */ + /* t_VD;DAT not necessary */ /* _i2c_delay (bus); */ /* SCL = passive HIGH (floating and pulled-up) */ diff --git a/cpu/esp32/periph/pwm.c b/cpu/esp32/periph/pwm.c index 1e78ad143d..64aca4257f 100644 --- a/cpu/esp32/periph/pwm.c +++ b/cpu/esp32/periph/pwm.c @@ -41,7 +41,7 @@ #define PWM_CLK (160000000UL) /* base clock of PWM devices */ #define PWM_CPS_MAX (10000000UL) /* maximum cycles per second supported */ -#define PWM_CPS_MIN (2500UL) /* minumum cycles per second supported */ +#define PWM_CPS_MIN (2500UL) /* minimum cycles per second supported */ #define PWM_TIMER_MOD_FREEZE 0 /* timer is disabled */ #define PWM_TIMER_MOD_UP 1 /* timer counts up */ @@ -54,7 +54,7 @@ #define PWM_TIMER_STARTS_STOPS_AT_TEZ 3 /* PWM starts and stops at next TEZ */ #define PWM_TIMER_STARTS_STOPS_AT_TEP 4 /* PWM starts and stops at next TEP */ -#define PWM_TIMER_UPDATE_IMMIDIATE 0 /* update period immediatly */ +#define PWM_TIMER_UPDATE_IMMIDIATE 0 /* update period immediately */ #define PWM_TIMER_UPDATE_AT_TEZ 1 /* update period at TEZ */ #define PWM_TIMER_UPDATE_AT_SYNC 2 /* update period at sync */ #define PWM_TIMER_UPDATE_AT_TEZ_SYNC 3 /* update period at TEZ and sync */ @@ -319,7 +319,7 @@ static void _pwm_start(pwm_t pwm) uint32_t cps = period * freq; /* maximum number of timer clock cycles per second (freq*period) must not - be greater than PWM_CPS_MAX, reduce the freq if neccessary and keep + be greater than PWM_CPS_MAX, reduce the freq if necessary and keep the resolution */ if (cps > PWM_CPS_MAX) { freq = PWM_CPS_MAX / period; @@ -328,7 +328,7 @@ static void _pwm_start(pwm_t pwm) __func__, freq); } /* minimum number of timer clock cycles per second (freq*period) must not - be less than PWM_CPS_MIN, increase the freq if neccessary and keep + be less than PWM_CPS_MIN, increase the freq if necessary and keep the resolution */ else if (cps < PWM_CPS_MIN) { freq = PWM_CPS_MIN / period; diff --git a/cpu/esp32/periph/rtc.c b/cpu/esp32/periph/rtc.c index d619d23d06..43f9b1d1ef 100644 --- a/cpu/esp32/periph/rtc.c +++ b/cpu/esp32/periph/rtc.c @@ -21,7 +21,7 @@ /* * If RTC_TIMER_USED is 0, the microsecond system timer is used to emulate an - * RTC, otherwise the RTC timer is used. Advantage of using RTC over sytem + * RTC, otherwise the RTC timer is used. Advantage of using RTC over system * timer is that it also continues in deep sleep and after software reset. */ #define RTC_TIMER_USED 1 @@ -175,7 +175,7 @@ int rtc_set_alarm(struct tm *time, rtc_alarm_cb_t cb, void *arg) /* * RTC doesn't provide alarm functionality in active mode. At least * the RTC main timer seems not to work. Therefore we always use the - * system timer for alarms. The Advantage of using RTC over sytem timer + * system timer for alarms. The Advantage of using RTC over system timer * is that it also continues in deep sleep and after software reset. */ #if 0 /* TODO should be RTC_TIMER_USED */ diff --git a/cpu/esp32/periph/spi.c b/cpu/esp32/periph/spi.c index b16a651f96..85d3b75371 100644 --- a/cpu/esp32/periph/spi.c +++ b/cpu/esp32/periph/spi.c @@ -49,7 +49,7 @@ #define FSPI_MISO GPIO7 #define FSPI_MOSI GPIO8 -/** stucture which decribes all properties of one SPI bus */ +/** structure which describes all properties of one SPI bus */ struct _spi_bus_t { spi_dev_t* regs; /* pointer to register data struct of the SPI device */ uint8_t mod; /* peripheral hardware module of the SPI interface */ @@ -180,7 +180,7 @@ static void _spi_init_internal (spi_t bus) _spi[bus].regs->ctrl.fastrd_mode = 0; _spi[bus].regs->ctrl.wp = 0; - /* aquire and release to set default parameters */ + /* acquire and release to set default parameters */ spi_acquire(bus, GPIO_UNDEF, SPI_MODE_0, SPI_CLK_1MHZ); spi_release(bus); } diff --git a/cpu/esp32/periph/timer.c b/cpu/esp32/periph/timer.c index b42b75a726..2bab6ca695 100644 --- a/cpu/esp32/periph/timer.c +++ b/cpu/esp32/periph/timer.c @@ -173,7 +173,7 @@ void IRAM hw_timer_handler(void* arg) (void)arg; /* since all timer interrupt sources are routed to the same cpu interrupt */ - /* signal, we can't use arg to identify the timer wich caused the it */ + /* signal, we can't use arg to identify the timer which caused the it */ irq_isr_enter(); diff --git a/cpu/esp32/startup.c b/cpu/esp32/startup.c index 5f1b5f9621..3a23b184bb 100644 --- a/cpu/esp32/startup.c +++ b/cpu/esp32/startup.c @@ -208,7 +208,7 @@ static void IRAM system_clk_init (void) /* set SLOW_CLK to internal low power clock of 150 kHz */ rtc_select_slow_clk(RTC_SLOW_FREQ_RTC); - /* wait until UART is idle to avoid loosing output */ + /* wait until UART is idle to avoid losing output */ uart_tx_wait_idle(CONFIG_CONSOLE_UART_NUM); ets_printf("Switching system clocks can lead to some unreadable characters\n"); ets_printf("This message is usually not visible at the console\n"); diff --git a/cpu/esp32/syscalls.c b/cpu/esp32/syscalls.c index 95ed6f782e..62e7c1293f 100644 --- a/cpu/esp32/syscalls.c +++ b/cpu/esp32/syscalls.c @@ -433,8 +433,8 @@ void system_wdt_init (void) TIMERG0.wdt_wprotect=TIMG_WDT_WKEY_VALUE; /* disable write protection */ TIMERG0.wdt_config0.stg0 = TIMG_WDT_STG_SEL_INT; /* stage0 timeout: interrupt */ TIMERG0.wdt_config0.stg1 = TIMG_WDT_STG_SEL_RESET_SYSTEM; /* stage1 timeout: sys reset */ - TIMERG0.wdt_config0.sys_reset_length = 7; /* sys reset signal lenght: 3.2 us */ - TIMERG0.wdt_config0.cpu_reset_length = 7; /* sys reset signal lenght: 3.2 us */ + TIMERG0.wdt_config0.sys_reset_length = 7; /* sys reset signal length: 3.2 us */ + TIMERG0.wdt_config0.cpu_reset_length = 7; /* sys reset signal length: 3.2 us */ TIMERG0.wdt_config0.edge_int_en = 0; TIMERG0.wdt_config0.level_int_en = 1; diff --git a/cpu/esp32/thread_arch.c b/cpu/esp32/thread_arch.c index 6f02df8cbc..517e208b83 100644 --- a/cpu/esp32/thread_arch.c +++ b/cpu/esp32/thread_arch.c @@ -140,7 +140,7 @@ char* thread_stack_init(thread_task_func_t task_func, void *arg, void *stack_sta /* Clear whole stack with a known value to assist debugging */ #if !defined(DEVELHELP) && !defined(SCHED_TEST_STACK) - /* Unfortunatly, this affects thread_measure_stack_free function */ + /* Unfortunately, this affects thread_measure_stack_free function */ memset(stack_start, 0, stack_size); #else memset(sp, 0, XT_STK_FRMSZ + XT_CP_SIZE); diff --git a/cpu/esp_common/esp-now/esp_now_netdev.h b/cpu/esp_common/esp-now/esp_now_netdev.h index 5f8a2838ae..c2637e3477 100644 --- a/cpu/esp_common/esp-now/esp_now_netdev.h +++ b/cpu/esp_common/esp-now/esp_now_netdev.h @@ -61,7 +61,7 @@ extern "C" { extern const netdev_driver_t esp_now_driver; /** - * @brief Header with neccesary flags for ESP-NOW packets + * @brief Header with necessary flags for ESP-NOW packets */ typedef struct __attribute__((packed)) { diff --git a/cpu/fe310/periph/gpio.c b/cpu/fe310/periph/gpio.c index 813d5c0fb8..1255bc0fda 100644 --- a/cpu/fe310/periph/gpio.c +++ b/cpu/fe310/periph/gpio.c @@ -115,7 +115,7 @@ void gpio_isr(int num) isr_ctx[pin].cb(isr_ctx[pin].arg); } - /* Clear interupt */ + /* Clear interrupt */ switch (isr_flank[pin]) { case GPIO_FALLING: GPIO_REG(GPIO_FALL_IP) |= (1 << pin); @@ -169,7 +169,7 @@ void gpio_irq_enable(gpio_t pin) return; } - /* Enable interupt for pin */ + /* Enable interrupt for pin */ switch (isr_flank[pin]) { case GPIO_FALLING: GPIO_REG(GPIO_FALL_IE) |= (1 << pin); @@ -196,7 +196,7 @@ void gpio_irq_disable(gpio_t pin) return; } - /* Disable interupt for pin */ + /* Disable interrupt for pin */ switch (isr_flank[pin]) { case GPIO_FALLING: GPIO_REG(GPIO_FALL_IE) &= ~(1 << pin); diff --git a/cpu/kinetis/dist/check-fcfield.sh b/cpu/kinetis/dist/check-fcfield.sh index 294f19ee5b..d172495a6d 100755 --- a/cpu/kinetis/dist/check-fcfield.sh +++ b/cpu/kinetis/dist/check-fcfield.sh @@ -35,7 +35,7 @@ get_fc_field() elif [ ${1##*.} = hex ]; then "${OBJDUMP}" --start-address=${FCFIELD_START} --stop-address=${FCFIELD_END} ${1} -s else - echo "Unkown file extension: ${1##*.}" + echo "Unknown file extension: ${1##*.}" exit 1 fi } diff --git a/cpu/kinetis/include/vectors_kinetis.h b/cpu/kinetis/include/vectors_kinetis.h index 929cdc9e93..fb37d941fb 100644 --- a/cpu/kinetis/include/vectors_kinetis.h +++ b/cpu/kinetis/include/vectors_kinetis.h @@ -92,7 +92,7 @@ void isr_dma14_dma30(void); /**< DMA channel 14, 30 transfer complete interrupt void isr_dma15_dma31(void); /**< DMA channel 15, 31 transfer complete interrupt handler */ void isr_dma_error(void); /**< DMA Error interrupt handler */ void isr_enet_1588_timer(void); /**< Ethernet MAC IEEE 1588 timer interrupt handler */ -void isr_enet_error(void); /**< Ethernet MAC error and miscelaneous interrupt handler */ +void isr_enet_error(void); /**< Ethernet MAC error and miscellaneous interrupt handler */ void isr_enet_receive(void); /**< Ethernet MAC receive interrupt handler */ void isr_enet_transmit(void); /**< Ethernet MAC transmit interrupt handler */ void isr_ftfa(void); /**< FTFA Command complete interrupt handler */ diff --git a/cpu/kinetis/vectors.c b/cpu/kinetis/vectors.c index a60cb3554e..151ddc5db8 100644 --- a/cpu/kinetis/vectors.c +++ b/cpu/kinetis/vectors.c @@ -366,7 +366,7 @@ ISR_VECTOR(1) const isr_t vector_cpu[CPU_IRQ_NUMOF] = { [ENET_1588_Timer_IRQn] = isr_enet_1588_timer, /* Ethernet MAC IEEE 1588 Timer Interrupt */ [ENET_Transmit_IRQn] = isr_enet_transmit, /* Ethernet MAC Transmit Interrupt */ [ENET_Receive_IRQn] = isr_enet_receive, /* Ethernet MAC Receive Interrupt */ - [ENET_Error_IRQn ] = isr_enet_error, /* Ethernet MAC Error and miscelaneous Interrupt */ + [ENET_Error_IRQn ] = isr_enet_error, /* Ethernet MAC Error and miscellaneous Interrupt */ #endif #ifdef LPUART0 [LPUART0_IRQn ] = isr_lpuart0, /* LPUART0 status/error interrupt */ diff --git a/cpu/lm4f120/periph/uart.c b/cpu/lm4f120/periph/uart.c index 550a47cb22..9db4fd9552 100644 --- a/cpu/lm4f120/periph/uart.c +++ b/cpu/lm4f120/periph/uart.c @@ -137,7 +137,7 @@ void isr_uart0(void) ulStatus = ROM_UARTIntStatus(UART0_BASE, true); ROM_UARTIntClear(UART0_BASE, ulStatus); - /* Are we interrupted due to a recieved character */ + /* Are we interrupted due to a received character */ if(ulStatus & (UART_INT_RX | UART_INT_RT)) { while(ROM_UARTCharsAvail(UART0_BASE)) diff --git a/cpu/lpc2387/lpc23xx-iap.c b/cpu/lpc2387/lpc23xx-iap.c index 2211f482f0..beda1ff3f2 100644 --- a/cpu/lpc2387/lpc23xx-iap.c +++ b/cpu/lpc2387/lpc23xx-iap.c @@ -196,9 +196,9 @@ uint32_t blank_check_sector(uint32_t tmp_sect1, uint32_t tmp_sect2) * affected sectors are automatically protected again once the copy command is * successfully executed. the boot sector cannot be written by this command. * Command: 51 - * Param0: (DST) Destination Flash adress where data bytes are to be written. + * Param0: (DST) Destination Flash address where data bytes are to be written. * This address should be a 512 byte boundary. - * Param1: (SRC) Source RAM adress from which data byre are to be read. + * Param1: (SRC) Source RAM address from which data byre are to be read. * Param2: Number of bytes to be written. Should be 512 | 1024 | 4096 | 8192. * Param3: System Clock Frequency (CCLK) in KHz. * diff --git a/cpu/lpc2387/mci/lpc2387-mci.c b/cpu/lpc2387/mci/lpc2387-mci.c index 804377fa11..76a22129b6 100644 --- a/cpu/lpc2387/mci/lpc2387-mci.c +++ b/cpu/lpc2387/mci/lpc2387-mci.c @@ -29,7 +29,7 @@ #define MCLK_RW 18000000UL /* MCICLK for data transfer (PCLK divided by even number) */ /* This MCI driver assumes that MCLK_RW is CCLK/4 or slower. If block buffer underrun/overrun -/ occured due to any interrupt by higher priority process or slow external memory, increasing +/ occurred due to any interrupt by higher priority process or slow external memory, increasing / N_BUF or decreasing MCLK_RW will solve it. */ @@ -130,7 +130,7 @@ void Isr_MCI(void) } } } - else { /* An MCI error occured (not DataBlockEnd) */ + else { /* An MCI error occurred (not DataBlockEnd) */ xs |= 8; } @@ -729,7 +729,7 @@ diskio_result_t mci_read(unsigned char *buff, unsigned long sector, unsigned cha } if (XferStat & 0xC) { - break; /* Abort if any error has occured */ + break; /* Abort if any error has occurred */ } copy_al2un(buff, DmaBuff[rp], 512); /* Pop an block */ @@ -737,7 +737,7 @@ diskio_result_t mci_read(unsigned char *buff, unsigned long sector, unsigned cha XferRp = rp = (rp + 1) % N_BUF; /* Next DMA buffer */ if (XferStat & 0xC) { - break; /* Abort if overrun has occured */ + break; /* Abort if overrun has occurred */ } buff += 512; /* Next user buffer address */ @@ -830,14 +830,14 @@ diskio_result_t mci_write(const unsigned char *buff, unsigned long sector, unsig } if (XferStat & 0xC) { - break; /* Abort if block underrun or any MCI error has occured */ + break; /* Abort if block underrun or any MCI error has occurred */ } copy_un2al(DmaBuff[wp], (unsigned char *)(unsigned int)buff, 512); /* Push a block */ XferWp = wp = (wp + 1) % N_BUF; /* Next DMA buffer */ if (XferStat & 0xC) { - break; /* Abort if block underrun has occured */ + break; /* Abort if block underrun has occurred */ } count--; @@ -847,7 +847,7 @@ diskio_result_t mci_write(const unsigned char *buff, unsigned long sector, unsig while (!(XferStat & 0xC)) {} /* Wait for all blocks sent (block underrun) */ if (XferStat & 0x8) { - count = 1; /* Abort if any MCI error has occured */ + count = 1; /* Abort if any MCI error has occurred */ } stop_transfer(); /* Close data path */ diff --git a/cpu/lpc2387/periph/rtc.c b/cpu/lpc2387/periph/rtc.c index 6de5ae2cd9..165cc1edc9 100644 --- a/cpu/lpc2387/periph/rtc.c +++ b/cpu/lpc2387/periph/rtc.c @@ -127,7 +127,7 @@ int rtc_set_alarm(struct tm *localt, rtc_alarm_cb_t cb, void *arg) RTC_ALDOY = localt->tm_yday; RTC_ALMON = localt->tm_mon + 1; RTC_ALYEAR = localt->tm_year; - RTC_AMR = 0; /* set wich alarm fields to check */ + RTC_AMR = 0; /* set which alarm fields to check */ DEBUG("alarm set %2lu.%2lu.%4lu %2lu:%2lu:%2lu\n", RTC_ALDOM, RTC_ALMON, RTC_ALYEAR, RTC_ALHOUR, RTC_ALMIN, RTC_ALSEC); diff --git a/cpu/mips32r2_common/newlib_syscalls_mips_uhi/syscalls.c b/cpu/mips32r2_common/newlib_syscalls_mips_uhi/syscalls.c index 87efbb0c57..d18894f5f4 100644 --- a/cpu/mips32r2_common/newlib_syscalls_mips_uhi/syscalls.c +++ b/cpu/mips32r2_common/newlib_syscalls_mips_uhi/syscalls.c @@ -70,7 +70,7 @@ void _exit(int n) exit(n); /* cppcheck-suppress unreachableCode - * (reason: pm_off spins indefinately after pulling the plug) */ + * (reason: pm_off spins indefinitely after pulling the plug) */ pm_off(); } @@ -127,7 +127,7 @@ pid_t _getpid_r(struct _reent *ptr) * @param sig signal number to pass to process * * @return -1 on error -* @return 0 on sucess +* @return 0 on success */ __attribute__ ((weak)) int _kill_r(struct _reent *r, pid_t pid, int sig) diff --git a/cpu/mips32r2_common/periph/pm.c b/cpu/mips32r2_common/periph/pm.c index e0d2b348ea..626534181c 100644 --- a/cpu/mips32r2_common/periph/pm.c +++ b/cpu/mips32r2_common/periph/pm.c @@ -24,7 +24,7 @@ void pm_set_lowest(void) { - /* Dont wait if interrupts are not enabled - we would never return!*/ + /* Don't wait if interrupts are not enabled - we would never return!*/ if (mips32_get_c0(C0_STATUS) & SR_IE) { __asm volatile ("wait"); } diff --git a/cpu/mips32r2_common/thread_arch.c b/cpu/mips32r2_common/thread_arch.c index 246da88074..26c1f79327 100644 --- a/cpu/mips32r2_common/thread_arch.c +++ b/cpu/mips32r2_common/thread_arch.c @@ -315,9 +315,9 @@ _mips_handle_exception(struct gpctx *ctx, int exception) /* * The toolchain Exception restore code just wholesale copies the - * status register from the context back to the register loosing - * any changes that may have occured, 'status' is really global state - * You dont enable interrupts on one thread and not another... + * status register from the context back to the register losing + * any changes that may have occurred, 'status' is really global state + * You don't enable interrupts on one thread and not another... * So we just copy the current status value into the saved value * so nothing changes on the restore */ diff --git a/cpu/mips_pic32_common/reset_mod.S b/cpu/mips_pic32_common/reset_mod.S index 78b11c496f..7042875524 100644 --- a/cpu/mips_pic32_common/reset_mod.S +++ b/cpu/mips_pic32_common/reset_mod.S @@ -240,5 +240,5 @@ LEAF(__boot_debug_exception) ehb deret 1: - b 1b #Spin indefinately + b 1b #Spin indefinitely END(__boot_debug_exception) diff --git a/cpu/msp430_common/include/sys/cdefs.h b/cpu/msp430_common/include/sys/cdefs.h index 06ad62ba3f..ce9db6c5fb 100644 --- a/cpu/msp430_common/include/sys/cdefs.h +++ b/cpu/msp430_common/include/sys/cdefs.h @@ -456,7 +456,7 @@ extern "C" { * * * These are meant to be used in places that are run `a lot'. * It is wasteful to make predictions in code that is run - * seldomly (e.g. at subsystem initialization time) as the + * seldom (e.g. at subsystem initialization time) as the * basic block reordering that this affects can often generate * larger code. */ diff --git a/cpu/msp430_common/include/sys/features.h b/cpu/msp430_common/include/sys/features.h index 19ff7e05eb..fc534079d7 100644 --- a/cpu/msp430_common/include/sys/features.h +++ b/cpu/msp430_common/include/sys/features.h @@ -235,7 +235,7 @@ extern "C" { * * In all cases above, "enabled by default" means either by defining * _DEFAULT_SOURCE, or by not defining any of the public feature test macros. - * Defining _GNU_SOURCE makes all of the above avaliable. + * Defining _GNU_SOURCE makes all of the above available. */ #ifdef _ATFILE_SOURCE diff --git a/cpu/native/socket_zep/socket_zep.c b/cpu/native/socket_zep/socket_zep.c index c0e229a3db..90fc1411ce 100644 --- a/cpu/native/socket_zep/socket_zep.c +++ b/cpu/native/socket_zep/socket_zep.c @@ -214,7 +214,7 @@ static int _recv(netdev_t *netdev, void *buf, size_t len, void *info) } if (((sizeof(zep_v2_data_hdr_t) + zep->length) != (unsigned)size) || (zep->length > len) || (zep->chan != dev->netdev.chan) || - /* TODO promiscous mode */ + /* TODO promiscuous mode */ _dst_not_me(dev, payload)) { /* TODO: check checksum */ return -1; diff --git a/cpu/nrf51/periph/pwm.c b/cpu/nrf51/periph/pwm.c index ab74b9def3..2fd64cf0cc 100644 --- a/cpu/nrf51/periph/pwm.c +++ b/cpu/nrf51/periph/pwm.c @@ -124,7 +124,7 @@ void pwm_set(pwm_t dev, uint8_t channel, uint16_t value) assert((dev == 0) && (channel == 0)); /* - * make sure duty cycle is set at the beggining of each period + * make sure duty cycle is set at the beginning of each period * ensure to stop the timer as soon as possible */ PWM_TIMER->TASKS_STOP = 1; diff --git a/cpu/nrf52/periph/i2c.c b/cpu/nrf52/periph/i2c.c index 873193a2ef..32d04a4c75 100644 --- a/cpu/nrf52/periph/i2c.c +++ b/cpu/nrf52/periph/i2c.c @@ -133,7 +133,7 @@ int i2c_write_regs(i2c_t dev, uint16_t addr, uint16_t reg, } /* the nrf52's TWI device does not support to do two consecutive transfers * without a repeated start condition in between. So we have to put all data - * to be transfered into a temporary buffer + * to be transferred into a temporary buffer * * CAUTION: this might become critical when transferring large blocks of * data as the temporary buffer is allocated on the stack... */ diff --git a/cpu/nrf52/radio/nrf802154/nrf802154.c b/cpu/nrf52/radio/nrf802154/nrf802154.c index 1fb7b96e62..9334ffd5a4 100644 --- a/cpu/nrf52/radio/nrf802154/nrf802154.c +++ b/cpu/nrf52/radio/nrf802154/nrf802154.c @@ -336,7 +336,7 @@ static int _recv(netdev_t *dev, void *buf, size_t len, void *info) radio_info->lqi = (uint8_t)(hwlqi > UINT8_MAX/ED_RSSISCALE ? UINT8_MAX : hwlqi * ED_RSSISCALE); - /* Calculate RSSI by substracting the offset from the datasheet. + /* Calculate RSSI by subtracting the offset from the datasheet. * Intentionally using a different calculation than the one from * figure 122 of the v1.1 product specification. This appears to * match real world performance better */ diff --git a/cpu/nrf5x_common/radio/nrfble/nrfble.c b/cpu/nrf5x_common/radio/nrfble/nrfble.c index bd0f4c8e90..dbce932fc6 100644 --- a/cpu/nrf5x_common/radio/nrfble/nrfble.c +++ b/cpu/nrf5x_common/radio/nrfble/nrfble.c @@ -247,7 +247,7 @@ static int _nrfble_init(netdev_t *dev) NRF_RADIO->RXADDRESSES = 0x01UL; /* load driver specific configuration */ NRF_RADIO->MODE = CONF_MODE; - /* configure data fields and packet length whitening and endianess */ + /* configure data fields and packet length whitening and endianness */ NRF_RADIO->PCNF0 = ((CONF_S1 << RADIO_PCNF0_S1LEN_Pos) | (CONF_S0 << RADIO_PCNF0_S0LEN_Pos) | (CONF_LEN << RADIO_PCNF0_LFLEN_Pos)); diff --git a/cpu/nrf5x_common/radio/nrfmin/nrfmin.c b/cpu/nrf5x_common/radio/nrfmin/nrfmin.c index 0dc1cf13e0..423f0b1184 100644 --- a/cpu/nrf5x_common/radio/nrfmin/nrfmin.c +++ b/cpu/nrf5x_common/radio/nrfmin/nrfmin.c @@ -425,7 +425,7 @@ static int nrfmin_init(netdev_t *dev) /* and listen to logical addresses 0 and 1 */ /* workaround errata nrf52832 3.41 [143] */ NRF_RADIO->RXADDRESSES = 0x10003UL; - /* configure data fields and packet length whitening and endianess */ + /* configure data fields and packet length whitening and endianness */ NRF_RADIO->PCNF0 = ((CONF_S1 << RADIO_PCNF0_S1LEN_Pos) | (CONF_S0 << RADIO_PCNF0_S0LEN_Pos) | (CONF_LEN << RADIO_PCNF0_LFLEN_Pos)); diff --git a/cpu/sam0_common/periph/rtc.c b/cpu/sam0_common/periph/rtc.c index d5d39594c1..0b49a332df 100644 --- a/cpu/sam0_common/periph/rtc.c +++ b/cpu/sam0_common/periph/rtc.c @@ -15,7 +15,7 @@ * @brief Low-level RTC driver implementation * * @author Baptiste Clenet - * @autor ported to SAML21 by FWX + * @author ported to SAML21 by FWX * @} */ diff --git a/cpu/sam0_common/periph/timer.c b/cpu/sam0_common/periph/timer.c index 294ea3694f..28975ccbd4 100644 --- a/cpu/sam0_common/periph/timer.c +++ b/cpu/sam0_common/periph/timer.c @@ -195,7 +195,7 @@ unsigned int timer_read(tim_t tim) /* request syncronisation */ #ifdef TC_CTRLBSET_CMD_READSYNC_Val dev(tim)->CTRLBSET.reg = TC_CTRLBSET_CMD_READSYNC; - /* work aroud a possible hardware bug where it takes some + /* work around a possible hardware bug where it takes some cycles for the timer peripheral to set the SYNCBUSY/READSYNC bit after writing the READSYNC bit diff --git a/cpu/sam3/periph/cpuid.c b/cpu/sam3/periph/cpuid.c index 2217b4367c..c0e07b3e21 100644 --- a/cpu/sam3/periph/cpuid.c +++ b/cpu/sam3/periph/cpuid.c @@ -33,7 +33,7 @@ __attribute__ ((section (".ramfunc"))) void cpuid_get(void *id) { - uint32_t cpuid[4]; /* 128 bits sam3 unique indentifier */ + uint32_t cpuid[4]; /* 128 bits sam3 unique identifier */ /* Reading SAM3 Unique Identifier process (P 19.3.3.8): diff --git a/cpu/samd21/cpu.c b/cpu/samd21/cpu.c index cb83b07d4e..7fd48e16ea 100644 --- a/cpu/samd21/cpu.c +++ b/cpu/samd21/cpu.c @@ -109,7 +109,7 @@ static void clk_init(void) SYSCTRL_XOSC32K_STARTUP(6) | SYSCTRL_XOSC32K_RUNSTDBY; - /* Enable with Seperate Call */ + /* Enable with Separate Call */ SYSCTRL->XOSC32K.bit.ENABLE = 1; /* reset the GCLK module so it is in a known state */ diff --git a/cpu/stm32_common/include/periph_cpu_common.h b/cpu/stm32_common/include/periph_cpu_common.h index a5fbb74bcc..de34d426f9 100644 --- a/cpu/stm32_common/include/periph_cpu_common.h +++ b/cpu/stm32_common/include/periph_cpu_common.h @@ -663,7 +663,7 @@ void dma_init(void); * @param[in] mode DMA mode * @param[in] flags DMA configuration * - * @return < 0 on error, the number of transfered bytes otherwise + * @return < 0 on error, the number of transferred bytes otherwise */ int dma_transfer(dma_t dma, int chan, const volatile void *src, volatile void *dst, size_t len, dma_mode_t mode, uint8_t flags); diff --git a/cpu/stm32_common/periph/i2c_1.c b/cpu/stm32_common/periph/i2c_1.c index 557131029e..9f6a6d8414 100644 --- a/cpu/stm32_common/periph/i2c_1.c +++ b/cpu/stm32_common/periph/i2c_1.c @@ -170,7 +170,7 @@ int i2c_write_regs(i2c_t dev, uint16_t addr, uint16_t reg, if (i2c->ISR & I2C_ISR_BUSY) { return -EAGAIN; } - /* Handle endianess of register if 16 bit */ + /* Handle endianness of register if 16 bit */ if (flags & I2C_REG16) { reg = htons(reg); /* Make sure register is in big-endian on I2C bus */ } @@ -405,7 +405,7 @@ static inline void irq_handler(i2c_t dev) I2C_TypeDef *i2c = i2c_config[dev].dev; unsigned state = i2c->ISR; - DEBUG("\n\n### I2C ERROR OCCURED ###\n"); + DEBUG("\n\n### I2C ERROR OCCURRED ###\n"); DEBUG("status: %08x\n", state); if (state & I2C_ISR_OVR) { DEBUG("OVR\n"); diff --git a/cpu/stm32_common/periph/i2c_2.c b/cpu/stm32_common/periph/i2c_2.c index 5a68a0167e..8cb037b4d4 100644 --- a/cpu/stm32_common/periph/i2c_2.c +++ b/cpu/stm32_common/periph/i2c_2.c @@ -436,7 +436,7 @@ static inline void irq_handler(i2c_t dev) assert(i2c != NULL); unsigned state = i2c->SR1; - DEBUG("\n\n### I2C ERROR OCCURED ###\n"); + DEBUG("\n\n### I2C ERROR OCCURRED ###\n"); DEBUG("status: %08x\n", state); if (state & I2C_SR1_OVR) { DEBUG("OVR\n"); diff --git a/cpu/stm32_common/periph/qdec.c b/cpu/stm32_common/periph/qdec.c index 613f45128f..cd3f86fc2e 100644 --- a/cpu/stm32_common/periph/qdec.c +++ b/cpu/stm32_common/periph/qdec.c @@ -156,7 +156,7 @@ static int32_t _qdec_read(qdec_t qdec, uint8_t reset) /* Restore IRQ */ irq_restore(irq_save); - /* Substract offset before return */ + /* Subtract offset before return */ count -= dev(qdec)->ARR / 2; /* Return count minus offset */ diff --git a/cpu/stm32f1/periph/rtt.c b/cpu/stm32f1/periph/rtt.c index 572927b5af..3f1015d7fe 100644 --- a/cpu/stm32f1/periph/rtt.c +++ b/cpu/stm32f1/periph/rtt.c @@ -91,7 +91,7 @@ void rtt_clear_overflow_cb(void) uint32_t rtt_get_counter(void) { - /* wait for syncronization */ + /* wait for synchronization */ while (!(RTT_DEV->CRL & RTT_FLAG_RSF)) {} return (((uint32_t)RTT_DEV->CNTH << 16 ) | (uint32_t)(RTT_DEV->CNTL)); @@ -111,7 +111,7 @@ void rtt_set_counter(uint32_t counter) uint32_t rtt_get_alarm(void) { - /* wait for syncronization */ + /* wait for synchronization */ while (!(RTT_DEV->CRL & RTT_FLAG_RSF)) {} return (((uint32_t)RTT_DEV->ALRH << 16 ) | (uint32_t)(RTT_DEV->ALRL)); diff --git a/cpu/stm32l4/periph/adc.c b/cpu/stm32l4/periph/adc.c index 11743016e1..7b9340ca9d 100644 --- a/cpu/stm32l4/periph/adc.c +++ b/cpu/stm32l4/periph/adc.c @@ -37,7 +37,7 @@ /* on stm32-l476rg all ADC clocks are are enabled by this bit further clock config is possible over CKMODE[1:0] bits in ADC_CCR reg */ #define ADC_CLK_EN_MASK (RCC_AHB2ENR_ADCEN) -/* refering to Datasheet Section 6.3.18 (ADC characteristics) the minimum +/* referring to Datasheet Section 6.3.18 (ADC characteristics) the minimum achievable sampling rate is 4.21 Msps (12 Bit resolution on slow channel) we use that worst case for configuring the sampling time to be sure it works on all channels. diff --git a/dist/tools/coccinelle/README.md b/dist/tools/coccinelle/README.md index 1e52acd9cf..e127268539 100644 --- a/dist/tools/coccinelle/README.md +++ b/dist/tools/coccinelle/README.md @@ -46,7 +46,7 @@ piping coccinelle's output into patch: Specifying BRANCH, FILES and/or a specific patch file works here, too. -Beware that some of our semantic patch files might just *find* occurences of +Beware that some of our semantic patch files might just *find* occurrences of bad code or style! Not all semantic patches output useful diffs. ## My PR has coccinelle warnings/errors! diff --git a/dist/tools/goodfet/goodfet.bsl b/dist/tools/goodfet/goodfet.bsl index 6ae64cb067..27bee6b2ce 100755 --- a/dist/tools/goodfet/goodfet.bsl +++ b/dist/tools/goodfet/goodfet.bsl @@ -1047,7 +1047,7 @@ class BootStrapLoader(LowLevel): sys.stderr.flush() #send the password self.bslTxRx(self.BSL_TXPWORD, #Command: Transmit Password - 0xffe0, #Address of interupt vectors + 0xffe0, #Address of interrupt vectors 0x0020, #Number of bytes passwd, #password wait=wait) #if wait is 1, try to sync forever @@ -1098,7 +1098,7 @@ class BootStrapLoader(LowLevel): if DEBUG: sys.stderr.write("Autodetect successful: %04x -> %s\n" % (dev_id, self.cpu)) else: - sys.stderr.write("Autodetect failed! Unkown ID: %04x. Trying to continue anyway.\n" % dev_id) + sys.stderr.write("Autodetect failed! Unknown ID: %04x. Trying to continue anyway.\n" % dev_id) self.cpu = F1x #assume something and try anyway.. sys.stderr.write("Current bootstrap loader version: %x.%x (Device ID: %04x)\n" % (bslVerHi, bslVerLo, dev_id)) @@ -1200,7 +1200,7 @@ class BootStrapLoader(LowLevel): self.txPasswd(self.passwd) #update version info - #verison only valid for the internal ones, but it also makes sure + #version only valid for the internal ones, but it also makes sure #that the patches are not applied if the user d/ls one self.bslVer = 0x0150 @@ -1306,7 +1306,7 @@ goodfet.bsl -e -p foo.hex sys.stderr.flush() self.bslTxRx(self.BSL_CHANGEBAUD, #Command: change baudrate a, l) #args are coded in adr and len - time.sleep(0.010) #recomended delay + time.sleep(0.010) #recommended delay self.serialport.baudrate = baudrate def actionReadBSLVersion(self): diff --git a/dist/tools/tunslip/tunslip.c b/dist/tools/tunslip/tunslip.c index 117bedc97d..651e2c2c7d 100644 --- a/dist/tools/tunslip/tunslip.c +++ b/dist/tools/tunslip/tunslip.c @@ -71,7 +71,7 @@ struct ip { u_int16_t ip_id; /* identification */ u_int16_t ip_off; /* fragment offset field */ #define IP_RF 0x8000 /* reserved fragment flag */ -#define IP_DF 0x4000 /* dont fragment flag */ +#define IP_DF 0x4000 /* don't fragment flag */ #define IP_MF 0x2000 /* more fragments flag */ #define IP_OFFMASK 0x1fff /* mask for fragmenting bits */ u_int8_t ip_ttl; /* time to live */ diff --git a/doc/doxygen/riot.doxyfile b/doc/doxygen/riot.doxyfile index a0fe1cc19a..356758f7a7 100644 --- a/doc/doxygen/riot.doxyfile +++ b/doc/doxygen/riot.doxyfile @@ -1670,7 +1670,7 @@ EXTRA_PACKAGES = # following commands have a special meaning inside the header: $title, # $datetime, $date, $doxygenversion, $projectname, $projectnumber, # $projectbrief, $projectlogo. Doxygen will replace $title with the empy string, -# for the replacement values of the other commands the user is refered to +# for the replacement values of the other commands the user is referred to # HTML_HEADER. # This tag requires that the tag GENERATE_LATEX is set to YES. diff --git a/drivers/ad7746/ad7746.c b/drivers/ad7746/ad7746.c index faf2a6d56b..45f3c8c69b 100644 --- a/drivers/ad7746/ad7746.c +++ b/drivers/ad7746/ad7746.c @@ -51,7 +51,7 @@ static const unsigned char _vt_sr_times[] = { * * @return AD7746_OK on success * @return AD7746_NODATA if no data is available - * @return AD7746_I2C on error getting a reponse + * @return AD7746_I2C on error getting a response */ static int _read_capacitance(ad7746_t *dev, int *value, ad7746_cap_input_t input); @@ -67,7 +67,7 @@ static int _read_capacitance(ad7746_t *dev, int *value, * * @return AD7746_OK on success * @return AD7746_NODATA if no data is available - * @return AD7746_I2C on error getting a reponse + * @return AD7746_I2C on error getting a response */ static int _read_voltage_temp(ad7746_t *dev, int *value, ad7746_vt_mode_t mode); @@ -83,7 +83,7 @@ static int _read_voltage_temp(ad7746_t *dev, int *value, ad7746_vt_mode_t mode); * * @return AD7746_OK on success * @return AD7746_NODATA if no data is available - * @return AD7746_I2C on error getting a reponse + * @return AD7746_I2C on error getting a response */ static int _read_raw_ch(const ad7746_t *dev, uint8_t ch, uint32_t *raw); diff --git a/drivers/ads101x/ads101x.c b/drivers/ads101x/ads101x.c index 31da0c99cc..843df3a6eb 100644 --- a/drivers/ads101x/ads101x.c +++ b/drivers/ads101x/ads101x.c @@ -133,11 +133,11 @@ int ads101x_read_raw(const ads101x_t *dev, int16_t *raw) /* Read control register */ i2c_read_regs(DEV, ADDR, ADS101X_CONF_ADDR, ®s, 2, 0x0); - /* Tell the ADC to aquire a single-shot sample */ + /* Tell the ADC to acquire a single-shot sample */ regs[0] |= ADS101X_CONF_OS_CONV; i2c_write_regs(DEV, ADDR, ADS101X_CONF_ADDR, ®s, 2, 0x0); - /* Wait for the sample to be aquired */ + /* Wait for the sample to be acquired */ xtimer_usleep(ADS101X_READ_DELAY); /* Read the sample */ diff --git a/drivers/bmx055/bmx055.c b/drivers/bmx055/bmx055.c index 244e0b5450..23d6387a27 100644 --- a/drivers/bmx055/bmx055.c +++ b/drivers/bmx055/bmx055.c @@ -138,7 +138,7 @@ int bmx055_init(bmx055_t *dev, const bmx055_params_t *params) /* Init Gyroscope * - * The prefered way to bring the module to normal mode is using softreset. + * The preferred way to bring the module to normal mode is using softreset. * However, a softreset brings the module into an unknown state and * deadlocks it. Hence it is not the way to go and normal mode is entered * by writing into power mode control register. diff --git a/drivers/ccs811/ccs811.c b/drivers/ccs811/ccs811.c index 86eca15c95..f7f8be78fb 100644 --- a/drivers/ccs811/ccs811.c +++ b/drivers/ccs811/ccs811.c @@ -485,7 +485,7 @@ static int _reg_read(const ccs811_t *dev, uint8_t reg, uint8_t *data, uint32_t l int res = CCS811_OK; if (i2c_acquire(dev->params.i2c_dev) != CCS811_OK) { - DEBUG_DEV("could not aquire I2C bus", dev); + DEBUG_DEV("could not acquire I2C bus", dev); return -CCS811_ERROR_I2C; } @@ -546,7 +546,7 @@ static int _reg_write(const ccs811_t *dev, uint8_t reg, uint8_t *data, uint32_t } if (i2c_acquire(dev->params.i2c_dev)) { - DEBUG_DEV("could not aquire I2C bus", dev); + DEBUG_DEV("could not acquire I2C bus", dev); return -CCS811_ERROR_I2C; } diff --git a/drivers/ccs811/doc.txt b/drivers/ccs811/doc.txt index aa7a92182d..57620b25f4 100644 --- a/drivers/ccs811/doc.txt +++ b/drivers/ccs811/doc.txt @@ -55,7 +55,7 @@ to get CCS811 working. ### Supported Features    [[TOC](#toc)] @note There are two driver module versions, the `ccs811` module -wich provides only basic functionality and the `ccs811_full` +which provides only basic functionality and the `ccs811_full` module with additional functionality. The `ccs811_full` module includes the `ccs811` module diff --git a/drivers/ccs811/include/ccs811_regs.h b/drivers/ccs811/include/ccs811_regs.h index 1fe0f5c63a..3ce1e2c2ef 100644 --- a/drivers/ccs811/include/ccs811_regs.h +++ b/drivers/ccs811/include/ccs811_regs.h @@ -52,7 +52,7 @@ extern "C" { * @name Status register bits (#CCS811_REG_STATUS) * @{ */ -#define CCS811_STATUS_ERROR (0x01) /**< error occured, details in CCS811_REG_ERROR */ +#define CCS811_STATUS_ERROR (0x01) /**< error occurred, details in CCS811_REG_ERROR */ #define CCS811_STATUS_DATA_RDY (0x08) /**< new data sample available in ALG_RESULT_DATA */ #define CCS811_STATUS_APP_VALID (0x10) /**< valid application firmware loaded */ #define CCS811_STATUS_FW_MODE (0x80) /**< firmware is in application mode */ diff --git a/drivers/dynamixel/include/dynamixel_reader.h b/drivers/dynamixel/include/dynamixel_reader.h index ee61d7da51..467fda3131 100644 --- a/drivers/dynamixel/include/dynamixel_reader.h +++ b/drivers/dynamixel/include/dynamixel_reader.h @@ -123,7 +123,7 @@ static inline uint16_t dynamixel_reader_get_crc(const dynamixel_reader_t *reader * * @param[in] reader the packet reader * - * @return the addess of the begining of the payload + * @return the addess of the beginning of the payload */ static inline const uint8_t *dynamixel_reader_status_get_payload(const dynamixel_reader_t *reader) { diff --git a/drivers/dynamixel/include/dynamixel_writer.h b/drivers/dynamixel/include/dynamixel_writer.h index 0d07182a97..1b404ad702 100644 --- a/drivers/dynamixel/include/dynamixel_writer.h +++ b/drivers/dynamixel/include/dynamixel_writer.h @@ -52,7 +52,7 @@ void dynamixel_writer_init(dynamixel_writer_t *writer, uint8_t *buffer, size_t l * * @param[out] writer the packet writer * - * @return the begining address of the buffer + * @return the beginning address of the buffer */ const uint8_t *dynamixel_writer_get_data(const dynamixel_writer_t *writer); diff --git a/drivers/enc28j60/enc28j60.c b/drivers/enc28j60/enc28j60.c index 202b50217c..75b02ad002 100644 --- a/drivers/enc28j60/enc28j60.c +++ b/drivers/enc28j60/enc28j60.c @@ -250,7 +250,7 @@ static void mac_set(enc28j60_t *dev, uint8_t *mac) static void on_int(void *arg) { - /* disable gobal interupt enable bit to avoid loosing interupts */ + /* disable gobal interrupt enable bit to avoid losing interupts */ cmd_bfc((enc28j60_t *)arg, REG_EIE, -1, EIE_INTIE); netdev_t *netdev = (netdev_t *)arg; @@ -331,7 +331,7 @@ static int nd_recv(netdev_t *netdev, void *buf, size_t max_len, void *info) cmd_w_addr(dev, ADDR_READ_PTR, ERXRDPT_TO_NEXT(rx_rd_ptr)); /* read packet header */ cmd_rbm(dev, head, 6); - /* TODO: care for endianess */ + /* TODO: care for endianness */ next = (uint16_t)((head[1] << 8) | head[0]); size = (uint16_t)((head[3] << 8) | head[2]) - 4; /* discard CRC */ @@ -493,7 +493,7 @@ static void nd_isr(netdev_t *netdev) } eir = cmd_rcr(dev, REG_EIR, -1); } - /* enable gobal interupt enable bit again */ + /* enable gobal interrupt enable bit again */ cmd_bfs(dev, REG_EIE, -1, EIE_INTIE); } diff --git a/drivers/encx24j600/include/encx24j600_internal.h b/drivers/encx24j600/include/encx24j600_internal.h index 8cf3b59c49..a4aa224a6f 100644 --- a/drivers/encx24j600/include/encx24j600_internal.h +++ b/drivers/encx24j600/include/encx24j600_internal.h @@ -31,7 +31,7 @@ typedef struct __attribute__((packed)) encx24j600_frame_hdr { uint16_t rx_next_ptr; /**< ptr to next packet whithin devices memory */ /* Receive Status Vector */ - uint16_t frame_len; /**< lenght of ethernet frame including 4 bytes + uint16_t frame_len; /**< length of ethernet frame including 4 bytes checksum */ uint32_t flags; /**< random flag field just mentioned for the sake of documentation completeness */ diff --git a/drivers/feetech/include/feetech_reader.h b/drivers/feetech/include/feetech_reader.h index ac62bf5d05..cd2ff5db31 100644 --- a/drivers/feetech/include/feetech_reader.h +++ b/drivers/feetech/include/feetech_reader.h @@ -157,7 +157,7 @@ static inline uint8_t feetech_reader_get_instr(const feetech_reader_t *reader) * * @param[in] reader the packet reader * - * @return the addess of the begining of the payload + * @return the addess of the beginning of the payload */ static inline const uint8_t *feetech_reader_response_get_payload(const feetech_reader_t *reader) { @@ -181,7 +181,7 @@ static inline size_t feetech_reader_response_get_payload_size(const feetech_read * * @param[in] reader the packet reader * - * @return the begining addess of the payload + * @return the beginning addess of the payload */ static inline const uint8_t *feetech_reader_write_get_payload(const feetech_reader_t *reader) { @@ -285,7 +285,7 @@ uint8_t feetech_reader_sync_write_item_get_id(const feetech_reader_t *reader, ui * @param[in] reader the packet reader * @param[in] index the item index * - * @return the begining addess of the payload + * @return the beginning addess of the payload */ const uint8_t *feetech_reader_sync_write_item_get_payload(const feetech_reader_t *reader, uint8_t index); diff --git a/drivers/feetech/include/feetech_writer.h b/drivers/feetech/include/feetech_writer.h index 64412d1c0e..ab2ac4b478 100644 --- a/drivers/feetech/include/feetech_writer.h +++ b/drivers/feetech/include/feetech_writer.h @@ -53,7 +53,7 @@ void feetech_writer_init(feetech_writer_t *writer, uint8_t *buffer, size_t buffe * * @param[out] writer the packet writer * - * @return the begining address of the buffer + * @return the beginning address of the buffer */ const uint8_t *feetech_writer_get_data(const feetech_writer_t *writer); diff --git a/drivers/include/ad7746.h b/drivers/include/ad7746.h index a1eac6a9f9..64a0ef84e7 100644 --- a/drivers/include/ad7746.h +++ b/drivers/include/ad7746.h @@ -179,7 +179,7 @@ int ad7746_init(ad7746_t *dev, const ad7746_params_t *params); * away. The time until new data is available will depend on the * @ref ad7746_params_t::cap_sample_rate "sample rate" of the channel. * - * @param[in, out] dev device decriptor + * @param[in, out] dev device descriptor * @param[out] value read value in fF * * @return AD7746_OK on success @@ -197,7 +197,7 @@ int ad7746_read_capacitance_1(ad7746_t *dev, int *value); * away. The time until new data is available will depend on the * @ref ad7746_params_t::cap_sample_rate "sample rate" of the channel. * - * @param[in, out] dev device decriptor + * @param[in, out] dev device descriptor * @param[out] value read value in fF * * @return AD7746_OK on success diff --git a/drivers/include/at30tse75x.h b/drivers/include/at30tse75x.h index 956f343542..2129949375 100644 --- a/drivers/include/at30tse75x.h +++ b/drivers/include/at30tse75x.h @@ -118,7 +118,7 @@ typedef enum { /** * @brief Operation mode * - * The device can run in continous or one-shot mode. While in one-shot mode it + * The device can run in continuous or one-shot mode. While in one-shot mode it * is effectively shutdown and only wakes up to perform a single measurement. * When in comparator or interrupt mode, the device samples contiously the * temperature and sets the ALERT pin according to the chosen mode. diff --git a/drivers/include/bmp180.h b/drivers/include/bmp180.h index 6919bc7e73..19396bf992 100644 --- a/drivers/include/bmp180.h +++ b/drivers/include/bmp180.h @@ -92,7 +92,7 @@ enum { * * @return BMP180_OK on success * @return -BMP180_ERR_NODEV if not a BMP180 at given address - * @return -BMP180_ERR_NOCAL if an error occured when reading calibration values + * @return -BMP180_ERR_NOCAL if an error occurred when reading calibration values */ int bmp180_init(bmp180_t *dev, const bmp180_params_t *params); diff --git a/drivers/include/diskio.h b/drivers/include/diskio.h index ef940f3eb1..5f48ede2c1 100644 --- a/drivers/include/diskio.h +++ b/drivers/include/diskio.h @@ -68,7 +68,7 @@ typedef enum { } diskio_sta_t; /** - * @name Command code for disk_ioctrl fucntion + * @name Command code for disk_ioctrl function * @{ */ diff --git a/drivers/include/ds18.h b/drivers/include/ds18.h index 2b54902d45..181c85da42 100644 --- a/drivers/include/ds18.h +++ b/drivers/include/ds18.h @@ -107,7 +107,7 @@ int ds18_read(const ds18_t *dev, int16_t *temperature); * @brief convenience fuction for triggering a conversion and reading the * value * - * @note This function will block for the convertion time. The current + * @note This function will block for the conversion time. The current * implementation of the driver uses 12-bit resolution, so this time is 750 ms. * * @param[in] dev device descriptor diff --git a/drivers/include/ds75lx.h b/drivers/include/ds75lx.h index 31fe414a6c..d349fb3beb 100644 --- a/drivers/include/ds75lx.h +++ b/drivers/include/ds75lx.h @@ -71,7 +71,7 @@ enum { * @param[in] params Initialization parameters * * @return DS75LX_OK on success - * @return -DS75LX_ERR_I2C if an error occured when reading/writing + * @return -DS75LX_ERR_I2C if an error occurred when reading/writing */ int ds75lx_init(ds75lx_t *dev, const ds75lx_params_t *params); @@ -82,7 +82,7 @@ int ds75lx_init(ds75lx_t *dev, const ds75lx_params_t *params); * @param[out] temperature Temperature in c°C * * @return DS75LX_OK on success - * @return -DS75LX_ERR_I2C if an error occured when reading/writing + * @return -DS75LX_ERR_I2C if an error occurred when reading/writing */ int ds75lx_read_temperature(const ds75lx_t *dev, int16_t *temperature); @@ -92,7 +92,7 @@ int ds75lx_read_temperature(const ds75lx_t *dev, int16_t *temperature); * @param[in] dev Device descriptor of DS75LX device * * @return DS75LX_OK on success - * @return -DS75LX_ERR_I2C if an error occured when reading/writing + * @return -DS75LX_ERR_I2C if an error occurred when reading/writing */ int ds75lx_wakeup(const ds75lx_t *dev); @@ -102,7 +102,7 @@ int ds75lx_wakeup(const ds75lx_t *dev); * @param[in] dev Device descriptor of DS75LX device * * @return DS75LX_OK on success - * @return -DS75LX_ERR_I2C if an error occured when reading/writing + * @return -DS75LX_ERR_I2C if an error occurred when reading/writing */ int ds75lx_shutdown(const ds75lx_t *dev); diff --git a/drivers/include/dsp0401.h b/drivers/include/dsp0401.h index 71602307e5..90401a6cc5 100644 --- a/drivers/include/dsp0401.h +++ b/drivers/include/dsp0401.h @@ -68,10 +68,10 @@ typedef struct { * @param[in] params Device parameters to use * * @return DSP0401_OK if everything is good - * @return -DSP0401_ERR_CLK_GPIO if an error occured during CLK GPIO initialization - * @return -DSP0401_ERR_SDI_GPIO if an error occured during SDI GPIO initialization - * @return -DSP0401_ERR_LAT_GPIO if an error occured during LAT GPIO initialization - * @return -DSP0401_ERR_PWM if an error occured during PWM initialization + * @return -DSP0401_ERR_CLK_GPIO if an error occurred during CLK GPIO initialization + * @return -DSP0401_ERR_SDI_GPIO if an error occurred during SDI GPIO initialization + * @return -DSP0401_ERR_LAT_GPIO if an error occurred during LAT GPIO initialization + * @return -DSP0401_ERR_PWM if an error occurred during PWM initialization */ int dsp0401_init(dsp0401_t *dev, const dsp0401_params_t *params); diff --git a/drivers/include/io1_xplained.h b/drivers/include/io1_xplained.h index 164789a905..0b2a6a60ee 100644 --- a/drivers/include/io1_xplained.h +++ b/drivers/include/io1_xplained.h @@ -32,7 +32,7 @@ * @{ * * @file - * @brief Device driver interface for the Atmel IO1 Xplained extention. + * @brief Device driver interface for the Atmel IO1 Xplained extension. * * @author Alexandre Abadie */ diff --git a/drivers/include/mtd.h b/drivers/include/mtd.h index dcf530e550..3be884c739 100644 --- a/drivers/include/mtd.h +++ b/drivers/include/mtd.h @@ -168,11 +168,11 @@ int mtd_init(mtd_dev_t *mtd); * @param[in] count the number of bytes to read * * @return the number of byte actually read - * @return < 0 if an error occured + * @return < 0 if an error occurred * @return -ENODEV if @p mtd is not a valid device * @return -ENOTSUP if operation is not supported on @p mtd * @return -EOVERFLOW if @p addr or @p count are not valid, i.e. outside memory - * @return -EIO if I/O error occured + * @return -EIO if I/O error occurred */ int mtd_read(mtd_dev_t *mtd, void *dest, uint32_t addr, uint32_t count); @@ -189,12 +189,12 @@ int mtd_read(mtd_dev_t *mtd, void *dest, uint32_t addr, uint32_t count); * @param[in] count the number of bytes to write * * @return the number of byte actually written - * @return < 0 if an error occured + * @return < 0 if an error occurred * @return -ENODEV if @p mtd is not a valid device * @return -ENOTSUP if operation is not supported on @p mtd * @return -EOVERFLOW if @p addr or @p count are not valid, i.e. outside memory, * or overlapping two pages - * @return -EIO if I/O error occured + * @return -EIO if I/O error occurred * @return -EINVAL if parameters are invalid (invalid alignment for instance) */ int mtd_write(mtd_dev_t *mtd, const void *src, uint32_t addr, uint32_t count); @@ -209,11 +209,11 @@ int mtd_write(mtd_dev_t *mtd, const void *src, uint32_t addr, uint32_t count); * @param[in] count the number of bytes to erase * * @return 0 if erase successful - * @return < 0 if an error occured + * @return < 0 if an error occurred * @return -ENODEV if @p mtd is not a valid device * @return -ENOTSUP if operation is not supported on @p mtd * @return -EOVERFLOW if @p addr or @p count are not valid, i.e. outside memory - * @return -EIO if I/O error occured + * @return -EIO if I/O error occurred */ int mtd_erase(mtd_dev_t *mtd, uint32_t addr, uint32_t count); @@ -224,10 +224,10 @@ int mtd_erase(mtd_dev_t *mtd, uint32_t addr, uint32_t count); * @param[in] power the power mode to set * * @return 0 if power mode successfully set - * @return < 0 if an error occured + * @return < 0 if an error occurred * @return -ENODEV if @p mtd is not a valid device * @return -ENOTSUP if operation or @p power state is not supported on @p mtd - * @return -EIO if I/O error occured + * @return -EIO if I/O error occurred */ int mtd_power(mtd_dev_t *mtd, enum mtd_power_state power); diff --git a/drivers/include/net/netdev/ieee802154.h b/drivers/include/net/netdev/ieee802154.h index e47483213f..b4a129ce0a 100644 --- a/drivers/include/net/netdev/ieee802154.h +++ b/drivers/include/net/netdev/ieee802154.h @@ -42,7 +42,7 @@ extern "C" { #define NETDEV_IEEE802154_SEND_MASK (0x0028) /**< flags to take for send packets */ #define NETDEV_IEEE802154_RAW (0x0002) /**< pass raw frame to upper layer */ /** - * @brief use long source addres (set) or short source address (unset) + * @brief use long source address (set) or short source address (unset) */ #define NETDEV_IEEE802154_SRC_MODE_LONG (0x0004) /** @@ -180,16 +180,16 @@ int netdev_ieee802154_set(netdev_ieee802154_t *dev, netopt_t opt, const void *va size_t value_len); /** - * @brief This funtion compares destination address and pan id with addresses + * @brief This function compares destination address and pan id with addresses * and pan id of the device * - * this funciton is meant top be used by drivers that do not support address + * this function is meant top be used by drivers that do not support address * filtering in hw * * @param[in] dev network device descriptor * @param[in] mhr mac header * - * @return 0 successfull if packet is for the device + * @return 0 successful if packet is for the device * @return 1 fails if packet is not for the device or pan */ int netdev_ieee802154_dst_filter(netdev_ieee802154_t *dev, const uint8_t *mhr); diff --git a/drivers/include/nrf24l01p.h b/drivers/include/nrf24l01p.h index 56fe845358..fa873aa58b 100644 --- a/drivers/include/nrf24l01p.h +++ b/drivers/include/nrf24l01p.h @@ -199,7 +199,7 @@ void nrf24l01p_transmit(const nrf24l01p_t *dev); * @param[in] answer Buffer to receive bytes to. * @param[in] size Number of bytes to transfer. For nrf24l01+ in general 32. * -* @return Number of bytes that were transfered. +* @return Number of bytes that were transferred. * @return -1 on error. */ int nrf24l01p_read_payload(const nrf24l01p_t *dev, char *answer, unsigned int size); @@ -277,7 +277,7 @@ void nrf24l01p_stop(const nrf24l01p_t *dev); * @param[in] data Buffer to preload. * @param[in] size Number of bytes in buffer. For nrf24l01+ e.g. 32 * -* @return Number of bytes that were transfered. +* @return Number of bytes that were transferred. * @return -1 on error. */ int nrf24l01p_preload(const nrf24l01p_t *dev, char *data, unsigned int size); diff --git a/drivers/include/periph/gpio_util.h b/drivers/include/periph/gpio_util.h index 0176c24332..971a24f095 100644 --- a/drivers/include/periph/gpio_util.h +++ b/drivers/include/periph/gpio_util.h @@ -28,7 +28,7 @@ extern "C" { /** * @brief Shift in a byte from data_pin, create clock pulses on clock_pin * - * This funtion has the same functionality as the Arduino shiftIn() in Advanced + * This function has the same functionality as the Arduino shiftIn() in Advanced * I/O. * * @param[in] data_pin Pin to read data from diff --git a/drivers/include/periph/hwrng.h b/drivers/include/periph/hwrng.h index 693bbda890..797264e8cb 100644 --- a/drivers/include/periph/hwrng.h +++ b/drivers/include/periph/hwrng.h @@ -52,7 +52,7 @@ extern "C" { * * On some platforms, the random number generator needs some global * initialization before it can be used. This should happen in this function - * if it would impose too much overhead to do this everytime the hwrng_read + * if it would impose too much overhead to do this every time the hwrng_read * function is called. The device should however be put into power-off mode * after initialization and will be powered on and of when hwrng_read is called. */ diff --git a/drivers/include/rn2xx3.h b/drivers/include/rn2xx3.h index 560b96bbbb..4a911e63cd 100644 --- a/drivers/include/rn2xx3.h +++ b/drivers/include/rn2xx3.h @@ -300,7 +300,7 @@ int rn2xx3_wait_response(rn2xx3_t *dev); * @return RN2XX3_REPLY_TX_MAC_ERR when MAC transmission failed * @return RN2XX3_REPLY_TX_MAC_RX when received downlink data from server * @return RN2XX3_REPLY_TX_INVALID_DATA_LEN when Application payload is too large - * @return RN2XX3_REPLY_JOIN_ACCEPTED when the join procedure succeded + * @return RN2XX3_REPLY_JOIN_ACCEPTED when the join procedure succeeded * @return RN2XX3_REPLY_JOIN_DENIED when the join procedure failed * @return RN2XX3_REPLY_OTHER when an unknown reply is received */ @@ -317,7 +317,7 @@ int rn2xx3_wait_reply(rn2xx3_t *dev, uint8_t timeout); * @return RN2XX3_ERR_NO_FREE_CH if channels are busy * @return RN2XX3_ERR_SILENT if device is in Silent state * @return RN2XX3_ERR_BUSY if MAC layer is in idle state - * @return RN2XX3_ERR_MAC_PAUSED if MAC layed is paused + * @return RN2XX3_ERR_MAC_PAUSED if MAC laid is paused * @return RN2XX3_REPLY_TX_INVALID_DATA_LEN if payload is too large * @return RN2XX3_REPLY_TX_MAC_ERR when MAC transmission failed * @return RN2XX3_REPLY_TX_MAC_RX when received downlink data from server @@ -335,8 +335,8 @@ int rn2xx3_mac_tx(rn2xx3_t *dev, uint8_t *payload, uint8_t payload_len); * @return RN2XX3_ERR_NO_FREE_CH if channels are busy * @return RN2XX3_ERR_SILENT if device is in Silent state * @return RN2XX3_ERR_BUSY if MAC layer is in idle state - * @return RN2XX3_ERR_MAC_PAUSED if MAC layed is paused - * @return RN2XX3_REPLY_JOIN_ACCEPTED when the join procedure succeded + * @return RN2XX3_ERR_MAC_PAUSED if MAC laid is paused + * @return RN2XX3_REPLY_JOIN_ACCEPTED when the join procedure succeeded * @return RN2XX3_REPLY_JOIN_DENIED when the join procedure failed */ int rn2xx3_mac_join_network(rn2xx3_t *dev, loramac_join_mode_t mode); diff --git a/drivers/include/sdcard_spi.h b/drivers/include/sdcard_spi.h index 9363f00ca8..5c78dadd5e 100644 --- a/drivers/include/sdcard_spi.h +++ b/drivers/include/sdcard_spi.h @@ -187,7 +187,7 @@ typedef struct { typedef struct { sdcard_spi_params_t params; /**< parameters for pin and spi config */ spi_clk_t spi_clk; /**< active SPI clock speed */ - bool use_block_addr; /**< true if block adressing (vs. byte adressing) is used */ + bool use_block_addr; /**< true if block addressing (vs. byte addressing) is used */ bool init_done; /**< set to true once the init procedure completed successfully */ sd_version_t card_type; /**< version of SD-card */ int csd_structure; /**< version of the CSD register structure */ @@ -206,7 +206,7 @@ typedef struct { * @param[in] params parameters for this device (pins and spi device are initialized by this driver) * * @return 0 if the card could be initialized successfully - * @return false if an error occured while initializing the card + * @return false if an error occurred while initializing the card */ int sdcard_spi_init(sdcard_spi_t *card, const sdcard_spi_params_t *params); @@ -214,10 +214,10 @@ int sdcard_spi_init(sdcard_spi_t *card, const sdcard_spi_params_t *params); * @brief Reads data blocks (usually multiples of 512 Bytes) from card to buffer. * * @param[in] card Initialized sd-card struct - * @param[in] blockaddr Start adress to read from. Independet of the actual adressing scheme of - * the used card the adress needs to be given as block address + * @param[in] blockaddr Start address to read from. Independent of the actual addressing scheme of + * the used card the address needs to be given as block address * (e.g. 0, 1, 2... NOT: 0, 512... ). The driver takes care of mapping to - * byte adressing if needed. + * byte addressing if needed. * @param[out] data Buffer to store the read data in. The user is responsible for providing a * suitable buffer size. * @param[in] blocksize Size of data blocks. For now only 512 byte blocks are supported because @@ -237,10 +237,10 @@ int sdcard_spi_read_blocks(sdcard_spi_t *card, int blockaddr, uint8_t *data, int * @brief Writes data blocks (usually multiples of 512 Bytes) from buffer to card. * * @param[in] card Initialized sd-card struct - * @param[in] blockaddr Start adress to read from. Independet of the actual adressing scheme of - * the used card the adress needs to be given as block address + * @param[in] blockaddr Start address to read from. Independent of the actual addressing scheme of + * the used card the address needs to be given as block address * (e.g. 0, 1, 2... NOT: 0, 512... ). The driver takes care of mapping to - * byte adressing if needed. + * byte addressing if needed. * @param[out] data Buffer that contains the data to be sent. * @param[in] blocksize Size of data blocks. For now only 512 byte blocks are supported because * only older (SDSC) cards support variable blocksizes anyway. diff --git a/drivers/include/sds011.h b/drivers/include/sds011.h index 2aca1a57a8..3eabd2f899 100644 --- a/drivers/include/sds011.h +++ b/drivers/include/sds011.h @@ -141,7 +141,7 @@ void sds011_power_off(const sds011_t *dev); * @return SDS011_OK on success * @return SDS011_INVALID_RESPONSE when response doesn't match the request * @return SDS011_INVALID_CHKSUM when response checksum is invalid - * @return SDS011_ERROR when other error occured + * @return SDS011_ERROR when other error occurred * * @pre @p dev != NULL * @pre @p data != NULL @@ -161,7 +161,7 @@ int sds011_read(sds011_t *dev, sds011_data_t *data); * @param[in] ctx context pointer that will be handed to the callback * * @return SDS011_OK on success - * @return SDS011_ERROR when error occured + * @return SDS011_ERROR when error occurred * * @pre @p dev != NULL */ @@ -177,7 +177,7 @@ int sds011_register_callback(sds011_t *dev, sds011_callback_t cb, void *ctx); * @return SDS011_OK on success * @return SDS011_INVALID_RESPONSE when response doesn't match the request * @return SDS011_INVALID_CHKSUM when response checksum is invalid - * @return SDS011_ERROR when other error occured + * @return SDS011_ERROR when other error occurred * * @pre @p dev != NULL */ @@ -196,7 +196,7 @@ int sds011_get_reporting_mode(sds011_t *dev, sds011_reporting_mode_t *mode); * @return SDS011_OK on success * @return SDS011_INVALID_RESPONSE when response doesn't match the request * @return SDS011_INVALID_CHKSUM when response checksum is invalid - * @return SDS011_ERROR when other error occured + * @return SDS011_ERROR when other error occurred * * @pre @p dev != NULL */ @@ -212,7 +212,7 @@ int sds011_set_reporting_mode(sds011_t *dev, sds011_reporting_mode_t mode); * @return SDS011_OK on success * @return SDS011_INVALID_RESPONSE when response doesn't match the request * @return SDS011_INVALID_CHKSUM when response checksum is invalid - * @return SDS011_ERROR when other error occured + * @return SDS011_ERROR when other error occurred * * @pre @p dev != NULL */ @@ -228,7 +228,7 @@ int sds011_get_working_mode(sds011_t *dev, sds011_working_mode_t *mode); * @return SDS011_OK on success * @return SDS011_INVALID_RESPONSE when response doesn't match the request * @return SDS011_INVALID_CHKSUM when response checksum is invalid - * @return SDS011_ERROR when other error occured + * @return SDS011_ERROR when other error occurred * * @pre @p dev != NULL */ @@ -243,7 +243,7 @@ int sds011_set_working_mode(sds011_t *dev, sds011_working_mode_t mode); * @return SDS011_OK on success * @return SDS011_INVALID_RESPONSE when response doesn't match the request * @return SDS011_INVALID_CHKSUM when response checksum is invalid - * @return SDS011_ERROR when other error occured + * @return SDS011_ERROR when other error occurred * * @pre @p dev != NULL */ @@ -264,7 +264,7 @@ int sds011_get_working_period(sds011_t *dev, uint8_t *minutes); * @return SDS011_OK on success * @return SDS011_INVALID_RESPONSE when response doesn't match the request * @return SDS011_INVALID_CHKSUM when response checksum is invalid - * @return SDS011_ERROR when other error occured + * @return SDS011_ERROR when other error occurred * * @pre @p dev != NULL */ @@ -281,7 +281,7 @@ int sds011_set_working_period(sds011_t *dev, uint8_t minutes); * @return SDS011_OK on success * @return SDS011_INVALID_RESPONSE when response doesn't match the request * @return SDS011_INVALID_CHKSUM when response checksum is invalid - * @return SDS011_ERROR when other error occured + * @return SDS011_ERROR when other error occurred * * @pre @p dev != NULL * @pre @p year != NULL @@ -303,7 +303,7 @@ int sds011_get_fw_version(sds011_t *dev, uint8_t *year, uint8_t *mon, uint8_t *d * @return SDS011_OK on success * @return SDS011_INVALID_RESPONSE when response doesn't match the request * @return SDS011_INVALID_CHKSUM when response checksum is invalid - * @return SDS011_ERROR when other error occured + * @return SDS011_ERROR when other error occurred * * @pre @p dev != NULL */ diff --git a/drivers/include/si70xx.h b/drivers/include/si70xx.h index 49a67776a6..fc6df0f238 100644 --- a/drivers/include/si70xx.h +++ b/drivers/include/si70xx.h @@ -36,7 +36,7 @@ extern "C" { enum { SI70XX_OK, /**< All OK */ SI70XX_ERR_NODEV, /**< No valid device found on I2C bus */ - SI70XX_ERR_I2C, /**< An error occured when reading/writing on I2C bus */ + SI70XX_ERR_I2C, /**< An error occurred when reading/writing on I2C bus */ }; /** diff --git a/drivers/kw2xrf/include/kw2xrf_getset.h b/drivers/kw2xrf/include/kw2xrf_getset.h index 5ffdf29d8c..682f5201a6 100644 --- a/drivers/kw2xrf/include/kw2xrf_getset.h +++ b/drivers/kw2xrf/include/kw2xrf_getset.h @@ -122,10 +122,10 @@ uint16_t kw2xrf_get_addr_short(kw2xrf_t *dev); uint64_t kw2xrf_get_addr_long(kw2xrf_t *dev); /** - * @brief Get CCA threshhold of a given device + * @brief Get CCA threshold of a given device * * @param[in] dev kw2xrf device descriptor - * @return current CCA threshhold + * @return current CCA threshold */ int8_t kw2xrf_get_cca_threshold(kw2xrf_t *dev); @@ -171,7 +171,7 @@ int16_t kw2xrf_get_rssi(uint32_t value); netopt_state_t kw2xrf_get_status(kw2xrf_t *dev); /** - * @brief Enable continous CCA + * @brief Enable continuous CCA * * @param[in] dev kw2xrf device descriptor * diff --git a/drivers/lis3mdl/include/lis3mdl-internal.h b/drivers/lis3mdl/include/lis3mdl-internal.h index 1a924e0f31..c6be099fa1 100644 --- a/drivers/lis3mdl/include/lis3mdl-internal.h +++ b/drivers/lis3mdl/include/lis3mdl-internal.h @@ -40,7 +40,7 @@ extern "C" { /** @} */ /** - * @name LIS3DML controll register + * @name LIS3DML control register * @{ */ #define LIS3MDL_CTRL_REG1 (0x20) diff --git a/drivers/mrf24j40/include/mrf24j40_internal.h b/drivers/mrf24j40/include/mrf24j40_internal.h index 9362996268..542eede8ca 100644 --- a/drivers/mrf24j40/include/mrf24j40_internal.h +++ b/drivers/mrf24j40/include/mrf24j40_internal.h @@ -31,7 +31,7 @@ extern "C" { /** - * @brief initialization as decribed in datasheet + * @brief initialization as described in datasheet * * @param[in] dev device to initialize * diff --git a/drivers/mrf24j40/mrf24j40_netdev.c b/drivers/mrf24j40/mrf24j40_netdev.c index 9f3ced52c7..f6864ed6e8 100644 --- a/drivers/mrf24j40/mrf24j40_netdev.c +++ b/drivers/mrf24j40/mrf24j40_netdev.c @@ -542,7 +542,7 @@ static void _isr(netdev_t *netdev) /* update pending bits */ mrf24j40_update_tasks(dev); DEBUG("[mrf24j40] INTERRUPT (pending: %x),\n", dev->pending); - /* Transmit interrupt occured */ + /* Transmit interrupt occurred */ if (dev->pending & MRF24J40_TASK_TX_READY) { dev->pending &= ~(MRF24J40_TASK_TX_READY); DEBUG("[mrf24j40] EVT - TX_END\n"); @@ -569,7 +569,7 @@ static void _isr(netdev_t *netdev) } #endif } - /* Receive interrupt occured */ + /* Receive interrupt occurred */ if (dev->pending & MRF24J40_TASK_RX_READY) { DEBUG("[mrf24j40] EVT - RX_END\n"); if ((dev->netdev.flags & MRF24J40_OPT_TELL_RX_END)) { diff --git a/drivers/nrf24l01p/nrf24l01p.c b/drivers/nrf24l01p/nrf24l01p.c index 7c83fdef1a..515e2b7db2 100644 --- a/drivers/nrf24l01p/nrf24l01p.c +++ b/drivers/nrf24l01p/nrf24l01p.c @@ -106,7 +106,7 @@ int nrf24l01p_init(nrf24l01p_t *dev, spi_t spi, gpio_t ce, gpio_t cs, gpio_t irq return status; } - /* Setup adress width */ + /* Setup address width */ status = nrf24l01p_set_address_width(dev, NRF24L01P_AW_5BYTE); if (status < 0) { @@ -148,7 +148,7 @@ int nrf24l01p_init(nrf24l01p_t *dev, spi_t spi, gpio_t ce, gpio_t cs, gpio_t irq return status; } - /* Set RX Adress */ + /* Set RX Address */ status = nrf24l01p_set_rx_address(dev, NRF24L01P_PIPE0, INITIAL_RX_ADDRESS, INITIAL_ADDRESS_WIDTH); if (status < 0) { diff --git a/drivers/periph_common/i2c.c b/drivers/periph_common/i2c.c index a24fd4560c..eb33e30937 100644 --- a/drivers/periph_common/i2c.c +++ b/drivers/periph_common/i2c.c @@ -44,7 +44,7 @@ int i2c_read_regs(i2c_t dev, uint16_t addr, uint16_t reg, return -EOPNOTSUPP; } - /* Handle endianess of register if 16 bit */ + /* Handle endianness of register if 16 bit */ if (flags & I2C_REG16) { reg_end = htons(reg); /* Make sure register is in big-endian on I2C bus */ } @@ -88,7 +88,7 @@ int i2c_write_regs(i2c_t dev, uint16_t addr, uint16_t reg, return -EOPNOTSUPP; } - /* Handle endianess of register if 16 bit */ + /* Handle endianness of register if 16 bit */ if (flags & I2C_REG16) { reg_end = htons(reg); /* Make sure register is in big-endian on I2C bus */ } diff --git a/drivers/sdcard_spi/include/sdcard_spi_internal.h b/drivers/sdcard_spi/include/sdcard_spi_internal.h index 3aa1b5ee37..be0d873b7d 100644 --- a/drivers/sdcard_spi/include/sdcard_spi_internal.h +++ b/drivers/sdcard_spi/include/sdcard_spi_internal.h @@ -179,10 +179,10 @@ typedef enum { * (for CMDX this parameter is simply the integer value X). * @param[in] argument The argument for the given cmd. As described by "7.3.1.1 Command Format". * This argument is transmitted byte wise with most significant byte first. - * @param[in] max_retry Specifies how often the command should be retried if an error occures. + * @param[in] max_retry Specifies how often the command should be retried if an error occurs. * Use 0 to try only once, -1 to try forever, or n to retry n times. * - * @return R1 response of the command if no (low-level) communication error occured + * @return R1 response of the command if no (low-level) communication error occurred * @return SD_INVALID_R1_RESPONSE if either waiting for the card to enter * not-busy-state timed out or spi communication failed */ @@ -197,10 +197,10 @@ uint8_t sdcard_spi_send_cmd(sdcard_spi_t *card, uint8_t sd_cmd_idx, uint32_t arg * (for ACMDX this parameter is simply the integer value X). * @param[in] argument The argument for the given cmd. As described by "7.3.1.1 Command Format". * This argument is transmitted byte wise with most significant byte first. - * @param[in] max_retry Specifies how often the command should be retried if an error occures. + * @param[in] max_retry Specifies how often the command should be retried if an error occurs. * Use 0 to try only once, -1 to try forever, or n to retry n times. * - * @return R1 response of the command if no (low-level) communication error occured + * @return R1 response of the command if no (low-level) communication error occurred * @return SD_INVALID_R1_RESPONSE if either waiting for the card to enter * not-busy-state timed out or spi communication failed */ diff --git a/drivers/sdcard_spi/sdcard_spi.c b/drivers/sdcard_spi/sdcard_spi.c index 88f46f1bf3..5e5aa90abe 100644 --- a/drivers/sdcard_spi/sdcard_spi.c +++ b/drivers/sdcard_spi/sdcard_spi.c @@ -254,13 +254,13 @@ static sd_init_fsm_state_t _init_sd_fsm_step(sdcard_spi_t *card, sd_init_fsm_sta DEBUG("OCR: POWER UP ROUTINE FINISHED\n"); /* if sd card is sdhc */ if ((ocr & OCR_CCS) != 0) { - DEBUG("OCR: CARD TYPE IS SDHC (SD_V2 with block adressing)\n"); + DEBUG("OCR: CARD TYPE IS SDHC (SD_V2 with block addressing)\n"); card->use_block_addr = true; _unselect_card_spi(card); return SD_INIT_READ_CID; } - DEBUG("OCR: CARD TYPE IS SDSC (SD_v2 with byte adressing)\n"); + DEBUG("OCR: CARD TYPE IS SDSC (SD_v2 with byte addressing)\n"); card->use_block_addr = false; return SD_INIT_SEND_CMD16; } @@ -284,7 +284,7 @@ static sd_init_fsm_state_t _init_sd_fsm_step(sdcard_spi_t *card, sd_init_fsm_sta DEBUG("SD_INIT_SEND_CMD16\n"); uint8_t r1_16 = sdcard_spi_send_cmd(card, SD_CMD_16, SD_HC_BLOCK_SIZE, INIT_CMD_RETRY_CNT); if (R1_VALID(r1_16) && !R1_ERROR(r1_16)) { - DEBUG("CARD TYPE IS SDSC (SD_V1 with byte adressing)\n"); + DEBUG("CARD TYPE IS SDSC (SD_V1 with byte addressing)\n"); _unselect_card_spi(card); return SD_INIT_READ_CID; } diff --git a/drivers/sht3x/sht3x.c b/drivers/sht3x/sht3x.c index 2f86f920ce..be92de32c5 100644 --- a/drivers/sht3x/sht3x.c +++ b/drivers/sht3x/sht3x.c @@ -288,7 +288,7 @@ static int _send_command(sht3x_dev_t* dev, uint16_t cmd) DEBUG_DEV("send command 0x%02x%02x", dev, data[0], data[1]); if (i2c_acquire(dev->i2c_dev) != 0) { - DEBUG_DEV ("could not aquire I2C bus", dev); + DEBUG_DEV ("could not acquire I2C bus", dev); return -SHT3X_ERROR_I2C; } @@ -310,7 +310,7 @@ static int _read_data(sht3x_dev_t* dev, uint8_t *data, uint8_t len) int res = SHT3X_OK; if (i2c_acquire(dev->i2c_dev) != 0) { - DEBUG_DEV ("could not aquire I2C bus", dev); + DEBUG_DEV ("could not acquire I2C bus", dev); return -SHT3X_ERROR_I2C; } diff --git a/drivers/sx127x/sx127x_getset.c b/drivers/sx127x/sx127x_getset.c index b491920c7c..8f9e23dbde 100644 --- a/drivers/sx127x/sx127x_getset.c +++ b/drivers/sx127x/sx127x_getset.c @@ -159,7 +159,7 @@ uint32_t sx127x_get_time_on_air(const sx127x_t *dev, uint8_t pkt_len) bw = 500e3; break; default: - DEBUG("Invalid bandwith: %d\n", dev->settings.lora.bandwidth); + DEBUG("Invalid bandwidth: %d\n", dev->settings.lora.bandwidth); break; } diff --git a/drivers/uart_half_duplex/include/uart_half_duplex.h b/drivers/uart_half_duplex/include/uart_half_duplex.h index 6701e15097..be1ec6bf33 100644 --- a/drivers/uart_half_duplex/include/uart_half_duplex.h +++ b/drivers/uart_half_duplex/include/uart_half_duplex.h @@ -90,7 +90,7 @@ enum { * @return UART_HALF_DUPLEX_OK if everything is in order * @return UART_HALF_DUPLEX_NODEV if invalid UART device was given * @return UART_HALF_DUPLEX_NOBAUD if given baudrate is not applicable - * @return UART_HALF_DUPLEX_INTERR if an other internal error occured + * @return UART_HALF_DUPLEX_INTERR if an other internal error occurred * @return UART_HALF_DUPLEX_NOMODE if the given mode is not applicable * @return UART_HALF_DUPLEX_NOBUFF if an invalid buffer was given */ diff --git a/examples/emcute_mqttsn/README.md b/examples/emcute_mqttsn/README.md index 362b685b5d..5afd7a95cd 100644 --- a/examples/emcute_mqttsn/README.md +++ b/examples/emcute_mqttsn/README.md @@ -2,7 +2,7 @@ This application demonstrates the usage of the emCute (MQTT-SN) module in RIOT. ## Setup -For using this example, two prerequisites have to be fullfilled: +For using this example, two prerequisites have to be fulfilled: 1. You need a running MQTT broker that supports MQTT-SN or a running MQTT-SN gateway that is connected to a running MQTT broker diff --git a/examples/gnrc_tftp/tftp_client.c b/examples/gnrc_tftp/tftp_client.c index 794c1cd693..013a5a7930 100644 --- a/examples/gnrc_tftp/tftp_client.c +++ b/examples/gnrc_tftp/tftp_client.c @@ -105,7 +105,7 @@ static int _tftp_client_data_cb(uint32_t offset, void *data, size_t data_len) static void _tftp_client_stop_cb(tftp_event_t event, const char *msg) { /* decode the stop event received */ - const char *cause = "UNKOWN"; + const char *cause = "UNKNOWN"; if (event == TFTP_SUCCESS) { cause = "SUCCESS"; diff --git a/examples/gnrc_tftp/tftp_server.c b/examples/gnrc_tftp/tftp_server.c index b0de42f855..96b025c71d 100644 --- a/examples/gnrc_tftp/tftp_server.c +++ b/examples/gnrc_tftp/tftp_server.c @@ -112,7 +112,7 @@ static int _tftp_server_data_cb(uint32_t offset, void *data, size_t data_len) static void _tftp_server_stop_cb(tftp_event_t event, const char *msg) { /* decode the stop event received */ - const char *cause = "UNKOWN"; + const char *cause = "UNKNOWN"; if (event == TFTP_SUCCESS) { cause = "SUCCESS"; diff --git a/makefiles/buildtests.inc.mk b/makefiles/buildtests.inc.mk index 734176baaf..63ebebd061 100644 --- a/makefiles/buildtests.inc.mk +++ b/makefiles/buildtests.inc.mk @@ -23,7 +23,7 @@ buildtest: $${RESULT} # Define 'buildtest-indocker' completely executed inside the container. -# It prevents starting one container per compilation wich is slower but it +# It prevents starting one container per compilation which is slower but it # could hide errors where the host toolchain would be used ifeq ($(BUILD_IN_DOCKER),1) buildtest-indocker: ..in-docker-container diff --git a/sys/arduino/sketches.inc.mk b/sys/arduino/sketches.inc.mk index ae71a78524..bb7c0bdd26 100644 --- a/sys/arduino/sketches.inc.mk +++ b/sys/arduino/sketches.inc.mk @@ -30,5 +30,5 @@ _ARDUINO_SKETCHES_MAKEFILE := $(lastword $(MAKEFILE_LIST)) $(SKETCH_MODULE_DIR)/$(SKETCH_CPP): $(_ARDUINO_SKETCHES_MAKEFILE) $(SKETCH_MODULE_DIR)/Makefile: $(_ARDUINO_SKETCHES_MAKEFILE) -# HACK Rebuild cpp files everytime in case one of the `SKETCHES` is deleted +# HACK Rebuild cpp files every time in case one of the `SKETCHES` is deleted $(SKETCH_MODULE_DIR)/$(SKETCH_CPP): FORCE diff --git a/sys/bitfield/bitfield.c b/sys/bitfield/bitfield.c index c710af3974..eb70d20661 100644 --- a/sys/bitfield/bitfield.c +++ b/sys/bitfield/bitfield.c @@ -10,7 +10,7 @@ * @{ * * @file - * @brief Bitfield auxillary functions + * @brief Bitfield auxiliary functions * * @author Kaspar Schleiser * diff --git a/sys/cpp11-compat/include/riot/detail/thread_util.hpp b/sys/cpp11-compat/include/riot/detail/thread_util.hpp index 1952df4bec..ae0dea2f79 100644 --- a/sys/cpp11-compat/include/riot/detail/thread_util.hpp +++ b/sys/cpp11-compat/include/riot/detail/thread_util.hpp @@ -80,7 +80,7 @@ inline auto apply_args(F& f, detail::int_list, Tuple&& tup) } /** - * @brief Prefix the argument tuple with additonal arguments. + * @brief Prefix the argument tuple with additional arguments. * In this case the tuple is empty. */ template @@ -90,7 +90,7 @@ inline auto apply_args_prefixed(F& f, detail::int_list<>, Tuple&, Ts&&... args) } /** - * @brief Prefix the argument tuple with additonal arguments. + * @brief Prefix the argument tuple with additional arguments. * In this case the tuple is contains arguments. */ template @@ -101,7 +101,7 @@ inline auto apply_args_prefixed(F& f, detail::int_list, Tuple& tup, } /** - * @brief Suffix the tuple with additonal arguments. + * @brief Suffix the tuple with additional arguments. */ template inline auto apply_args_suffxied(F& f, detail::int_list, Tuple& tup, diff --git a/sys/crypto/modes/ocb.c b/sys/crypto/modes/ocb.c index e9dcf26a66..7777f55597 100644 --- a/sys/crypto/modes/ocb.c +++ b/sys/crypto/modes/ocb.c @@ -306,7 +306,7 @@ int32_t cipher_encrypt_ocb(cipher_t *cipher, uint8_t *auth_data, OCB_MODE_ENCRYPT); if (cipher_text_length < 0) { - // An error occured. Return the error code + // An error occurred. Return the error code return cipher_text_length; } /* C = C_1 || C_2 || ... || C_m || C_* || Tag[1..TAGLEN] */ @@ -331,7 +331,7 @@ int32_t cipher_decrypt_ocb(cipher_t *cipher, uint8_t *auth_data, OCB_MODE_DECRYPT); if (plain_text_length < 0) { - // An error occured. Retur the error code + // An error occurred. Retur the error code return plain_text_length; } /* Check the tag */ diff --git a/sys/include/bloom.h b/sys/include/bloom.h index 3b2c841153..de43bd7811 100644 --- a/sys/include/bloom.h +++ b/sys/include/bloom.h @@ -201,7 +201,7 @@ void bloom_add(bloom_t *bloom, const uint8_t *buf, size_t len); * it may also be that another string just happened to produce a hash value * that would also set this bit. That would be a false positive. This is why * we have k > 1, so we can minimize the likelihood of false positives - * occuring. + * occurring. * * If every bit corresponding to every one of the k hashes of our query * string is set, we can say with some probability of being correct that diff --git a/sys/include/can/doc.txt b/sys/include/can/doc.txt index 089aa8edf1..8112e5838a 100644 --- a/sys/include/can/doc.txt +++ b/sys/include/can/doc.txt @@ -7,7 +7,7 @@ * It includes a low-level interface, a data link layer, an ISO-TP layer and * a user interface. * - * The low-level interface, candev, must be implemented by controler drivers. + * The low-level interface, candev, must be implemented by controller drivers. * The optional transceiver support can also be activated. Transceiver drivers must * then implement the trx_can interface. * diff --git a/sys/include/can/isotp.h b/sys/include/can/isotp.h index 4228604b02..2f2ded03e6 100644 --- a/sys/include/can/isotp.h +++ b/sys/include/can/isotp.h @@ -167,7 +167,7 @@ kernel_pid_t isotp_init(char *stack, int stacksize, char priority, const char *n * @param flags flags for sending * * @return the number of bytes sent - * @return < 0 if an error occured (-EBUSY, -ENOMEM) + * @return < 0 if an error occurred (-EBUSY, -ENOMEM) */ int isotp_send(struct isotp *isotp, const void *buf, int len, int flags); diff --git a/sys/include/can/pkt.h b/sys/include/can/pkt.h index c57ec0bd00..2538aee3d0 100644 --- a/sys/include/can/pkt.h +++ b/sys/include/can/pkt.h @@ -62,7 +62,7 @@ void can_pkt_init(void); * @param[in] frame the frame to copy * @param[in] tx_pid the pid of the sender's device thread * - * @return an allocated CAN packet, NULL if an error occured + * @return an allocated CAN packet, NULL if an error occurred */ can_pkt_t *can_pkt_alloc_tx(int ifnum, const struct can_frame *frame, kernel_pid_t tx_pid); @@ -72,7 +72,7 @@ can_pkt_t *can_pkt_alloc_tx(int ifnum, const struct can_frame *frame, kernel_pid * @param[in] ifnum the interface number * @param[in] frame the received frame * - * @return an allocated CAN packet, NULL if an error occured + * @return an allocated CAN packet, NULL if an error occurred */ can_pkt_t *can_pkt_alloc_rx(int ifnum, const struct can_frame *frame); @@ -87,7 +87,7 @@ can_pkt_t *can_pkt_alloc_rx(int ifnum, const struct can_frame *frame); * @param[in] frame the frame to copy * @param[in] mbox the pointer to the sender's mbox * - * @return an allocated CAN packet, NULL if an error occured + * @return an allocated CAN packet, NULL if an error occurred */ can_pkt_t *can_pkt_alloc_mbox_tx(int ifnum, const struct can_frame *frame, mbox_t *mbox); #endif diff --git a/sys/include/crypto/ciphers.h b/sys/include/crypto/ciphers.h index a3487c833c..6d28756ae0 100644 --- a/sys/include/crypto/ciphers.h +++ b/sys/include/crypto/ciphers.h @@ -65,7 +65,7 @@ extern "C" { #define CIPHER_ERR_DEC_FAILED -6 /** Is returned by the cipher_init functions, if the coresponding alogirithm has not been included in the build */ #define CIPHER_ERR_BAD_CONTEXT_SIZE 0 -/** Returned by cipher_init upon succesful initialization of a cipher. */ +/** Returned by cipher_init upon successful initialization of a cipher. */ #define CIPHER_INIT_SUCCESS 1 /** diff --git a/sys/include/iolist.h b/sys/include/iolist.h index 987c760ce4..ff6c27f23d 100644 --- a/sys/include/iolist.h +++ b/sys/include/iolist.h @@ -54,7 +54,7 @@ unsigned iolist_count(const iolist_t *iolist); /** * @brief Sum up number of bytes in iolist * - * This function returns the summed ip lenght values of all entries in @p + * This function returns the summed ip length values of all entries in @p * iolist. * * @param[in] iolist iolist to sum up diff --git a/sys/include/irq_handler.h b/sys/include/irq_handler.h index 97f79e9f77..db0af4c250 100644 --- a/sys/include/irq_handler.h +++ b/sys/include/irq_handler.h @@ -66,11 +66,11 @@ * handler places the interrupt event in an pending interrupt queue. * * Each interrupt event can be registered on the handler only once. That is, - * if the same interrupt occurs multiple times, only its first occurence is + * if the same interrupt occurs multiple times, only its first occurrence is * placed to the pending interrupt queue and is handled. * * When the interrupt handler thread gets the CPU, it processes all pending - * interrupt events in the order of their occurence before it yields. + * interrupt events in the order of their occurrence before it yields. * * ## Usage * @@ -218,7 +218,7 @@ typedef struct { * structures. For the initialization of static interrupt event structures * use #IRQ_EVENT_INIT instead. * - * @param[out] irq Pre-allocated #irq_event_t sturcture, must not be NULL + * @param[out] irq Pre-allocated #irq_event_t structure, must not be NULL */ static inline void irq_event_init(irq_event_t *irq) @@ -236,7 +236,7 @@ static inline void irq_event_init(irq_event_t *irq) * * Each interrupt event can be added only once to the pending interrupt queue. * That is, if the same interrupt occurs multiple times, only its first - * occurence is placed to the pending interrupt queue and is handled. + * occurrence is placed to the pending interrupt queue and is handled. * * @param[in] irq Preallocated interrupt event * diff --git a/sys/include/net/cord/ep_standalone.h b/sys/include/net/cord/ep_standalone.h index 9d900b71ed..e2f4be4d90 100644 --- a/sys/include/net/cord/ep_standalone.h +++ b/sys/include/net/cord/ep_standalone.h @@ -74,7 +74,7 @@ void cord_ep_standalone_reg_cb(cord_ep_standalone_cb_t cb); * @brief Signal the cord_ep thread about connection status change * * @note This function should not be called by a user, but it is called from - * withing the cord_ep implementation + * within the cord_ep implementation * * @param[in] connected set to true if we are connected to a RD */ diff --git a/sys/include/net/csma_sender.h b/sys/include/net/csma_sender.h index b7183c0325..4abb307200 100644 --- a/sys/include/net/csma_sender.h +++ b/sys/include/net/csma_sender.h @@ -96,7 +96,7 @@ extern const csma_sender_conf_t CSMA_SENDER_CONF_DEFAULT; * @return -ENOMSG if @p pkt is invalid * @return -EOVERFLOW if the payload size of @p pkt exceeds the * payload size that can be handled by the device - * @return -ECANCELED if an internal driver error occured + * @return -ECANCELED if an internal driver error occurred * @return -EBUSY if radio medium never was available * to send the given data */ @@ -127,7 +127,7 @@ int csma_sender_csma_ca_send(netdev_t *dev, iolist_t *iolist, * @return -ENOMSG if @p pkt is invalid * @return -EOVERFLOW if the payload size of @p pkt exceeds the * payload size that can be handled by the device - * @return -ECANCELED if an internal driver error occured + * @return -ECANCELED if an internal driver error occurred * @return -EBUSY if radio medium was not available * to send the given data */ diff --git a/sys/include/net/eui64.h b/sys/include/net/eui64.h index 6211d20a5a..c8e4af0833 100644 --- a/sys/include/net/eui64.h +++ b/sys/include/net/eui64.h @@ -9,7 +9,7 @@ /** * @defgroup net_eui64 IEEE EUI-64 identifier * @ingroup net - * @brief Type definiton of the IEEE EUI-64 identifier + * @brief Type definition of the IEEE EUI-64 identifier * @see * IEEE, "Guidelines for 64-bit Global Identifier (EUI-64)" * diff --git a/sys/include/net/gnrc/ipv6/nib.h b/sys/include/net/gnrc/ipv6/nib.h index a3acfa9066..40a03aa4a0 100644 --- a/sys/include/net/gnrc/ipv6/nib.h +++ b/sys/include/net/gnrc/ipv6/nib.h @@ -282,7 +282,7 @@ enum { * might however get an INCOMPLETE or STALE notification due to that, as * soon as the neighbor enters the neighbor cache again). * - * Be adviced to only use `ctx_addr` in the context of the callback, since + * Be advised to only use `ctx_addr` in the context of the callback, since * it might be overwritten, after the callback was left. */ GNRC_IPV6_NIB_ROUTE_INFO_TYPE_NSC, diff --git a/sys/include/net/gnrc/ndp.h b/sys/include/net/gnrc/ndp.h index 94aff38982..5ae27e4d51 100644 --- a/sys/include/net/gnrc/ndp.h +++ b/sys/include/net/gnrc/ndp.h @@ -216,7 +216,7 @@ gnrc_pktsnip_t *gnrc_ndp_opt_tl2a_build(const uint8_t *l2addr, * @param[in] valid_ltime Length of time in seconds that @p prefix is valid. * UINT32_MAX represents infinity. * @param[in] pref_ltime Length of time in seconds that addresses using - * @p prefix remain prefered. UINT32_MAX represents + * @p prefix remain preferred. UINT32_MAX represents * infinity. * @param[in] flags Flags as defined in net/ndp.h. * - @ref NDP_OPT_PI_FLAGS_L == 1 indicates, that diff --git a/sys/include/net/gnrc/neterr.h b/sys/include/net/gnrc/neterr.h index fc89cd437b..ed96e7e0c1 100644 --- a/sys/include/net/gnrc/neterr.h +++ b/sys/include/net/gnrc/neterr.h @@ -38,7 +38,7 @@ extern "C" { #define GNRC_NETERR_MSG_TYPE (0x0206) /** - * @brief Error code to signalise success (no error occured) to an gnrc_neterr subscriber. + * @brief Error code to signalise success (no error occurred) to an gnrc_neterr subscriber. */ #define GNRC_NETERR_SUCCESS (0) diff --git a/sys/include/net/gnrc/pkt.h b/sys/include/net/gnrc/pkt.h index 74f19fd93a..efa363003c 100644 --- a/sys/include/net/gnrc/pkt.h +++ b/sys/include/net/gnrc/pkt.h @@ -142,7 +142,7 @@ static inline size_t gnrc_pkt_len(const gnrc_pktsnip_t *pkt) } /** - * @brief Calculates length of a packet in byte upto (including) a snip with the given type. + * @brief Calculates length of a packet in byte up to (including) a snip with the given type. * * @param[in] pkt list of packet snips. * @param[in] type type of snip to stop calculation. diff --git a/sys/include/net/gnrc/rpl.h b/sys/include/net/gnrc/rpl.h index 5fb31cba4a..39a08b75f4 100644 --- a/sys/include/net/gnrc/rpl.h +++ b/sys/include/net/gnrc/rpl.h @@ -517,7 +517,7 @@ gnrc_rpl_instance_t *gnrc_rpl_root_init(uint8_t instance_id, ipv6_addr_t *dodag_ * @brief Send a DIO of the @p instance to the @p destination. * * @param[in] instance Pointer to the RPL instance. - * @param[in] destination IPv6 addres of the destination. + * @param[in] destination IPv6 address of the destination. */ void gnrc_rpl_send_DIO(gnrc_rpl_instance_t *instance, ipv6_addr_t *destination); @@ -525,7 +525,7 @@ void gnrc_rpl_send_DIO(gnrc_rpl_instance_t *instance, ipv6_addr_t *destination); * @brief Send a DIS of the @p instace to the @p destination. * * @param[in] instance Pointer to the RPL instance, optional. - * @param[in] destination IPv6 addres of the destination. + * @param[in] destination IPv6 address of the destination. * @param[in] options Pointer to the first option to be attached. * @param[in] num_opts The number of options to attach. */ @@ -536,7 +536,7 @@ void gnrc_rpl_send_DIS(gnrc_rpl_instance_t *instance, ipv6_addr_t *destination, * @brief Send a DAO of the @p dodag to the @p destination. * * @param[in] instance Pointer to the instance. - * @param[in] destination IPv6 addres of the destination. + * @param[in] destination IPv6 address of the destination. * @param[in] lifetime Lifetime of the route to announce. */ void gnrc_rpl_send_DAO(gnrc_rpl_instance_t *instance, ipv6_addr_t *destination, uint8_t lifetime); @@ -545,7 +545,7 @@ void gnrc_rpl_send_DAO(gnrc_rpl_instance_t *instance, ipv6_addr_t *destination, * @brief Send a DAO-ACK of the @p instance to the @p destination. * * @param[in] instance Pointer to the RPL instance. - * @param[in] destination IPv6 addres of the destination. + * @param[in] destination IPv6 address of the destination. * @param[in] seq Sequence number to be acknowledged. */ void gnrc_rpl_send_DAO_ACK(gnrc_rpl_instance_t *instance, ipv6_addr_t *destination, uint8_t seq); diff --git a/sys/include/net/gnrc/tcp.h b/sys/include/net/gnrc/tcp.h index 3b33a3c971..e2be82ed89 100644 --- a/sys/include/net/gnrc/tcp.h +++ b/sys/include/net/gnrc/tcp.h @@ -60,7 +60,7 @@ void gnrc_tcp_tcb_init(gnrc_tcp_tcb_t *tcb); * @pre @p target_addr must not be NULL. * @pre @p target_port must not be 0. * - * @note Blocks until a connection has been established or an error occured. + * @note Blocks until a connection has been established or an error occurred. * * @param[in,out] tcb TCB holding the connection information. * @param[in] address_family Address family of @p target_addr. @@ -85,15 +85,15 @@ int gnrc_tcp_open_active(gnrc_tcp_tcb_t *tcb, uint8_t address_family, uint16_t local_port); /** - * @brief Opens a connection passively, by waiting for an incomming request. + * @brief Opens a connection passively, by waiting for an incoming request. * * @pre gnrc_tcp_tcb_init() must have been successfully called. * @pre @p tcb must not be NULL. * @pre if local_addr is not NULL, local_addr must be assigned to a network interface. * @pre if local_port is not zero. * - * @note Blocks until a connection has been established (incomming connection request - * to @p local_port) or an error occured. + * @note Blocks until a connection has been established (incoming connection request + * to @p local_port) or an error occurred. * * @param[in,out] tcb TCB holding the connection information. * @param[in] address_family Address family of @p local_addr. @@ -121,7 +121,7 @@ int gnrc_tcp_open_passive(gnrc_tcp_tcb_t *tcb, uint8_t address_family, * @pre @p tcb must not be NULL. * @pre @p data must not be NULL. * - * @note Blocks until up to @p len bytes were transmitted or an error occured. + * @note Blocks until up to @p len bytes were transmitted or an error occurred. * * @param[in,out] tcb TCB holding the connection information. * @param[in] data Pointer to the data that should be transmitted. diff --git a/sys/include/net/gnrc/tftp.h b/sys/include/net/gnrc/tftp.h index 5dad010000..0c4110d8a5 100644 --- a/sys/include/net/gnrc/tftp.h +++ b/sys/include/net/gnrc/tftp.h @@ -127,7 +127,7 @@ typedef enum { * * @param [in] action The action the transfer want to perform * @param [in] mode The data mode of the transfer - * @param [in] file_name The filename of the file being transfered + * @param [in] file_name The filename of the file being transferred * @param [in/out] data_len When a read action is performed, the application must give * the total transfer size of the data. When a write action * is performed the total transfer size will be given. diff --git a/sys/include/net/ieee802154.h b/sys/include/net/ieee802154.h index 0f86442b50..32486d1611 100644 --- a/sys/include/net/ieee802154.h +++ b/sys/include/net/ieee802154.h @@ -194,7 +194,7 @@ extern const uint8_t ieee802154_addr_bcast[IEEE802154_ADDR_BCAST_LEN]; * Otherwise, it will be ignored, when * @ref IEEE802154_FCF_PAN_COMP is set. * @param[in] dst_pan Destination PAN ID in little-endian. - * @param[in] flags Flags for the frame. These are interchangable with the + * @param[in] flags Flags for the frame. These are interchangeable with the * first byte of the IEEE 802.15.4 FCF. This means that * it encompasses the type values, * @ref IEEE802154_FCF_SECURITY_EN, diff --git a/sys/include/net/nanocoap.h b/sys/include/net/nanocoap.h index b469f511bc..26806007d2 100644 --- a/sys/include/net/nanocoap.h +++ b/sys/include/net/nanocoap.h @@ -693,7 +693,7 @@ void coap_block_slicer_init(coap_block_slicer_t *slicer, size_t blknum, * @param[in] c byte array to copy * @param[in] len length of the byte array * - * @returns Number of bytes writen to @p bufpos + * @returns Number of bytes written to @p bufpos */ size_t coap_blockwise_put_bytes(coap_block_slicer_t *slicer, uint8_t *bufpos, const uint8_t *c, size_t len); @@ -709,7 +709,7 @@ size_t coap_blockwise_put_bytes(coap_block_slicer_t *slicer, uint8_t *bufpos, * @param[in] bufpos pointer to the current payload buffer position * @param[in] c character to write * - * @returns Number of bytes writen to @p bufpos + * @returns Number of bytes written to @p bufpos */ size_t coap_blockwise_put_char(coap_block_slicer_t *slicer, uint8_t *bufpos, char c); diff --git a/sys/include/net/ppp/hdr.h b/sys/include/net/ppp/hdr.h index bf09e24ba4..679f15ec10 100644 --- a/sys/include/net/ppp/hdr.h +++ b/sys/include/net/ppp/hdr.h @@ -32,7 +32,7 @@ extern "C" { /** * @brief Header of a PPP packet - * @details A PPP packet is transmited as a payload of an HDLC packet. PPP packets only carry information about control protocol + * @details A PPP packet is transmitted as a payload of an HDLC packet. PPP packets only carry information about control protocol * of a PPP stack (Link Control Protocol, IP Control Protocol, etc). IP packets encapsulated in HDLC frame are not * considered PPP packet. * diff --git a/sys/include/net/sixlowpan.h b/sys/include/net/sixlowpan.h index 17e9f0cef8..382136048d 100644 --- a/sys/include/net/sixlowpan.h +++ b/sys/include/net/sixlowpan.h @@ -257,7 +257,7 @@ static inline uint16_t sixlowpan_frag_offset(sixlowpan_frag_n_t *hdr) #define SIXLOWPAN_IPHC1_HL (0x03) /** - * @brief Flag for Context Identifier Extention (part of second byte + * @brief Flag for Context Identifier Extension (part of second byte * of LOWPAN_IPHC). * @see * RFC 6282, section 3.1.1 diff --git a/sys/include/net/sock.h b/sys/include/net/sock.h index b57da9497f..ebf9481c06 100644 --- a/sys/include/net/sock.h +++ b/sys/include/net/sock.h @@ -147,7 +147,7 @@ extern "C" { /** * @brief Special netif ID for "any interface" - * @todo Use an equivalent defintion from PR #5511 + * @todo Use an equivalent definition from PR #5511 */ #define SOCK_ADDR_ANY_NETIF (0) diff --git a/sys/include/universal_address.h b/sys/include/universal_address.h index 1228ea6225..55689ee980 100644 --- a/sys/include/universal_address.h +++ b/sys/include/universal_address.h @@ -114,7 +114,7 @@ uint8_t* universal_address_get_address(universal_address_container_t *entry, * @param[in] entry pointer to the universal_address_container_t for compare * @param[in] addr pointer to the address for compare * @param[in, out] addr_size_in_bits the number of bits used for the address entry - * on sucessfull return this value is overwritten + * on successful return this value is overwritten * with the number of matching bits till the * first of trailing `0`s * diff --git a/sys/include/xtimer.h b/sys/include/xtimer.h index 19321c010b..61648f9f10 100644 --- a/sys/include/xtimer.h +++ b/sys/include/xtimer.h @@ -500,7 +500,7 @@ static inline int xtimer_msg_receive_timeout64(msg_t *msg, uint64_t timeout); * (in callback:) * overhead=xtimer_now()-start-X; * - * xtimer automatically substracts XTIMER_OVERHEAD from a timer's target time, + * xtimer automatically subtracts XTIMER_OVERHEAD from a timer's target time, * but when the timer triggers, xtimer will spin-lock until a timer's target * time is reached, so timers will never trigger early. * diff --git a/sys/net/gnrc/application_layer/tftp/gnrc_tftp.c b/sys/net/gnrc/application_layer/tftp/gnrc_tftp.c index a5647a51ce..a77d5e5508 100644 --- a/sys/net/gnrc/application_layer/tftp/gnrc_tftp.c +++ b/sys/net/gnrc/application_layer/tftp/gnrc_tftp.c @@ -576,7 +576,7 @@ tftp_state _tftp_state_processes(tftp_context_t *ctxt, msg_t *m) return _tftp_send_start(ctxt, outbuf); } else if (m->type == TFTP_TIMEOUT_MSG) { - DEBUG("tftp: timeout occured\n"); + DEBUG("tftp: timeout occurred\n"); if (++(ctxt->retries) > GNRC_TFTP_MAX_RETRIES) { /* transfer failed due to lost peer */ DEBUG("tftp: peer lost\n"); diff --git a/sys/net/gnrc/link_layer/lwmac/lwmac.c b/sys/net/gnrc/link_layer/lwmac/lwmac.c index 1e7216f260..a293dcfcfd 100644 --- a/sys/net/gnrc/link_layer/lwmac/lwmac.c +++ b/sys/net/gnrc/link_layer/lwmac/lwmac.c @@ -827,7 +827,7 @@ static void _lwmac_event_cb(netdev_t *dev, netdev_event_t event) } } - /* Execute main state machine because something just happend*/ + /* Execute main state machine because something just happened*/ while (gnrc_lwmac_get_reschedule(netif)) { lwmac_update(netif); } @@ -843,7 +843,7 @@ static int _send(gnrc_netif_t *netif, gnrc_pktsnip_t *pkt) lwmac_schedule_update(netif); - /* Execute main state machine because something just happend*/ + /* Execute main state machine because something just happened*/ while (gnrc_lwmac_get_reschedule(netif)) { lwmac_update(netif); } @@ -891,7 +891,7 @@ static void _lwmac_msg_handler(gnrc_netif_t *netif, msg_t *msg) } } - /* Execute main state machine because something just happend*/ + /* Execute main state machine because something just happened*/ while (gnrc_lwmac_get_reschedule(netif)) { lwmac_update(netif); } diff --git a/sys/net/gnrc/network_layer/ipv6/nib/_nib-internal.h b/sys/net/gnrc/network_layer/ipv6/nib/_nib-internal.h index fbd773351a..114a850827 100644 --- a/sys/net/gnrc/network_layer/ipv6/nib/_nib-internal.h +++ b/sys/net/gnrc/network_layer/ipv6/nib/_nib-internal.h @@ -251,7 +251,7 @@ extern evtimer_msg_t _nib_evtimer; * * This value is returned by @ref @_nib_drl_get_dr() when it is not NULL and it * is reachable. Otherwise it is selected with the [default router selection - * algoritm](https://tools.ietf.org/html/rfc4861#section-6.3.6) by that function. + * algorithm](https://tools.ietf.org/html/rfc4861#section-6.3.6) by that function. * Exposed to be settable by @ref net_gnrc_ipv6_nib_ft. */ extern _nib_dr_entry_t *_prime_def_router; diff --git a/sys/net/gnrc/routing/rpl/srh/gnrc_rpl_srh.c b/sys/net/gnrc/routing/rpl/srh/gnrc_rpl_srh.c index 1bf47f5dc0..b5e53347b7 100644 --- a/sys/net/gnrc/routing/rpl/srh/gnrc_rpl_srh.c +++ b/sys/net/gnrc/routing/rpl/srh/gnrc_rpl_srh.c @@ -102,7 +102,7 @@ int gnrc_rpl_srh_process(ipv6_hdr_t *ipv6, gnrc_rpl_srh_t *rh, void **err_ptr) return GNRC_IPV6_EXT_RH_ERROR; } if (ipv6_addr_is_multicast(&addr)) { - DEBUG("RPL SRH: found a multicast addres in next address - discard\n"); + DEBUG("RPL SRH: found a multicast address in next address - discard\n"); return GNRC_IPV6_EXT_RH_ERROR; } diff --git a/sys/net/gnrc/transport_layer/tcp/gnrc_tcp.c b/sys/net/gnrc/transport_layer/tcp/gnrc_tcp.c index a45be10b82..d4fde531f1 100644 --- a/sys/net/gnrc/transport_layer/tcp/gnrc_tcp.c +++ b/sys/net/gnrc/transport_layer/tcp/gnrc_tcp.c @@ -132,7 +132,7 @@ static int _gnrc_tcp_open(gnrc_tcp_tcb_t *tcb, char *target_addr, uint16_t targe return -EISCONN; } - /* Mark TCB as waiting for incomming messages */ + /* Mark TCB as waiting for incoming messages */ tcb->status |= STATUS_WAIT_FOR_MSG; /* 'Flush' mbox */ @@ -155,7 +155,7 @@ static int _gnrc_tcp_open(gnrc_tcp_tcb_t *tcb, char *target_addr, uint16_t targe } } #else - /* Supress Compiler Warnings */ + /* Suppress Compiler Warnings */ (void) target_addr; #endif /* Set port number to listen on */ @@ -180,7 +180,7 @@ static int _gnrc_tcp_open(gnrc_tcp_tcb_t *tcb, char *target_addr, uint16_t targe } } #endif - /* Assign port numbers, verfication happens in fsm */ + /* Assign port numbers, verification happens in fsm */ tcb->local_port = local_port; tcb->peer_port = target_port; @@ -359,7 +359,7 @@ ssize_t gnrc_tcp_send(gnrc_tcp_tcb_t *tcb, const void *data, const size_t len, return -ENOTCONN; } - /* Mark TCB as waiting for incomming messages */ + /* Mark TCB as waiting for incoming messages */ tcb->status |= STATUS_WAIT_FOR_MSG; /* 'Flush' mbox */ @@ -421,7 +421,7 @@ ssize_t gnrc_tcp_send(gnrc_tcp_tcb_t *tcb, const void *data, const size_t len, _fsm(tcb, FSM_EVENT_SEND_PROBE, NULL, NULL, 0); probe_timeout_duration_us += probe_timeout_duration_us; - /* Boundry check for time interval between probes */ + /* Boundary check for time interval between probes */ if (probe_timeout_duration_us < GNRC_TCP_PROBE_LOWER_BOUND) { probe_timeout_duration_us = GNRC_TCP_PROBE_LOWER_BOUND; } @@ -499,7 +499,7 @@ ssize_t gnrc_tcp_recv(gnrc_tcp_tcb_t *tcb, void *data, const size_t max_len, return ret; } - /* Mark TCB as waiting for incomming messages */ + /* Mark TCB as waiting for incoming messages */ tcb->status |= STATUS_WAIT_FOR_MSG; /* 'Flush' mbox */ @@ -580,7 +580,7 @@ void gnrc_tcp_close(gnrc_tcp_tcb_t *tcb) return; } - /* Mark TCB as waiting for incomming messages */ + /* Mark TCB as waiting for incoming messages */ tcb->status |= STATUS_WAIT_FOR_MSG; /* 'Flush' mbox */ diff --git a/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_eventloop.c b/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_eventloop.c index d478ba849d..5b11d112cc 100644 --- a/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_eventloop.c +++ b/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_eventloop.c @@ -86,11 +86,11 @@ static int _send(gnrc_pktsnip_t *pkt) /** * @brief Receive function, receive packet from network layer. * - * @param[in] pkt Incomming paket. + * @param[in] pkt Incoming paket. * * @returns Zero on success. * Negative value on error. - * -EACCES if write access to packet was not aquired. + * -EACCES if write access to packet was not acquired. * -ERANGE if segment offset value is less than 5. * -ENOMSG if paket couldn't be marked. * -EINVAL if checksum was invalid. @@ -183,7 +183,7 @@ static int _receive(gnrc_pktsnip_t *pkt) tcb = _list_tcb_head; while (tcb) { #ifdef MODULE_GNRC_IPV6 - /* Check if current TCB is fitting for the incomming packet */ + /* Check if current TCB is fitting for the incoming packet */ if (ip->type == GNRC_NETTYPE_IPV6 && tcb->address_family == AF_INET6) { /* If SYN is set, a connection is listening on that port ... */ ipv6_addr_t *tmp_addr = NULL; @@ -206,7 +206,7 @@ static int _receive(gnrc_pktsnip_t *pkt) } } #else - /* Supress compiler warnings if TCP is build without network layer */ + /* Suppress compiler warnings if TCP is built without network layer */ (void) syn; (void) src; (void) dst; diff --git a/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_fsm.c b/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_fsm.c index 09cbe23d39..68a99ba016 100644 --- a/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_fsm.c +++ b/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_fsm.c @@ -384,10 +384,10 @@ static int _fsm_call_abort(gnrc_tcp_tcb_t *tcb) } /** - * @brief FSM handling function for processing of an incomming TCP packet. + * @brief FSM handling function for processing of an incoming TCP packet. * * @param[in,out] tcb TCB holding the connection information. - * @param[in] in_pkt Incomming packet. + * @param[in] in_pkt Incoming packet. * * @returns Zero on success. * -ENOMEM if receive buffer could not be allocated. @@ -398,12 +398,12 @@ static int _fsm_rcvd_pkt(gnrc_tcp_tcb_t *tcb, gnrc_pktsnip_t *in_pkt) uint16_t seq_con = 0; /* Sequence number consumption of outgoing packet */ gnrc_pktsnip_t *snp = NULL; /* Temporary packet snip */ gnrc_tcp_tcb_t *lst = NULL; /* Temporary pointer to TCB */ - uint16_t ctl = 0; /* Control bits of the incomming packet */ - uint32_t seg_seq = 0; /* Sequence number of the incomming packet*/ - uint32_t seg_ack = 0; /* Acknowledgment number of the incomming packet */ - uint32_t seg_wnd = 0; /* Receive window of the incomming packet */ - uint32_t seg_len = 0; /* Segment length of the incomming packet */ - uint32_t pay_len = 0; /* Payload length of the incomming packet */ + uint16_t ctl = 0; /* Control bits of the incoming packet */ + uint32_t seg_seq = 0; /* Sequence number of the incoming packet*/ + uint32_t seg_ack = 0; /* Acknowledgment number of the incoming packet */ + uint32_t seg_wnd = 0; /* Receive window of the incoming packet */ + uint32_t seg_len = 0; /* Segment length of the incoming packet */ + uint32_t pay_len = 0; /* Payload length of the incoming packet */ DEBUG("gnrc_tcp_fsm.c : _fsm_rcvd_pkt()\n"); /* Search for TCP header. */ @@ -425,7 +425,7 @@ static int _fsm_rcvd_pkt(gnrc_tcp_tcb_t *tcb, gnrc_pktsnip_t *in_pkt) #ifdef MODULE_GNRC_IPV6 LL_SEARCH_SCALAR(in_pkt, snp, type, GNRC_NETTYPE_IPV6); if (snp == NULL) { - DEBUG("gnrc_tcp_fsm.c : _fsm_rcvd_pkt() : incomming packet had no IPv6 header\n"); + DEBUG("gnrc_tcp_fsm.c : _fsm_rcvd_pkt() : incoming packet had no IPv6 header\n"); return 0; } void *ip = snp->data; @@ -443,7 +443,7 @@ static int _fsm_rcvd_pkt(gnrc_tcp_tcb_t *tcb, gnrc_pktsnip_t *in_pkt) _pkt_send(tcb, out_pkt, 0, false); return 0; } - /* 3) Check SYN: if SYN is set prepare for incomming connection */ + /* 3) Check SYN: if SYN is set prepare for incoming connection */ if (ctl & MSK_SYN) { uint16_t src = byteorder_ntohs(tcp_hdr->src_port); uint16_t dst = byteorder_ntohs(tcp_hdr->dst_port); @@ -487,7 +487,7 @@ static int _fsm_rcvd_pkt(gnrc_tcp_tcb_t *tcb, gnrc_pktsnip_t *in_pkt) * (reason: tmp *can* be != NULL after LL_SEARCH_SCALAR) */ if (tmp == NULL) { DEBUG("gnrc_tcp_fsm.c : _fsm_rcvd_pkt() :\ - incomming packet had no netif header\n"); + incoming packet had no netif header\n"); return 0; } tcb->ll_iface = ((gnrc_netif_hdr_t *)tmp->data)->if_pid; @@ -655,7 +655,7 @@ static int _fsm_rcvd_pkt(gnrc_tcp_tcb_t *tcb, gnrc_pktsnip_t *in_pkt) } } /* Additional processing */ - /* Check additionaly if previously sent FIN was acknowledged */ + /* Check additionally if previously sent FIN was acknowledged */ if (tcb->state == FSM_STATE_FIN_WAIT_1) { if (tcb->pkt_retransmit == NULL) { _transition_to(tcb, FSM_STATE_FIN_WAIT_2); @@ -896,7 +896,7 @@ int _fsm(gnrc_tcp_tcb_t *tcb, fsm_event_t event, gnrc_pktsnip_t *in_pkt, void *b tcb->status &= ~STATUS_NOTIFY_USER; int32_t result = _fsm_unprotected(tcb, event, in_pkt, buf, len); - /* Notify blocked thread if something interesting happend */ + /* Notify blocked thread if something interesting happened */ if ((tcb->status & STATUS_NOTIFY_USER) && (tcb->status & STATUS_WAIT_FOR_MSG)) { msg_t msg; msg.type = MSG_TYPE_NOTIFY_USER; diff --git a/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_pkt.c b/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_pkt.c index 802bf1d1c7..5d22d4cfec 100644 --- a/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_pkt.c +++ b/sys/net/gnrc/transport_layer/tcp/gnrc_tcp_pkt.c @@ -313,7 +313,7 @@ int _pkt_chk_seq_num(const gnrc_tcp_tcb_t *tcb, const uint32_t seq_num, const ui return 0; } - /* Everthing else is not acceptable */ + /* Everything else is not acceptable */ return -1; } @@ -403,7 +403,7 @@ int _pkt_setup_retransmit(gnrc_tcp_tcb_t *tcb, gnrc_pktsnip_t *pkt, const bool r } } - /* Perform boundry checks on current RTO before usage */ + /* Perform boundary checks on current RTO before usage */ if (tcb->rto < (int32_t) GNRC_TCP_RTO_LOWER_BOUND) { tcb->rto = GNRC_TCP_RTO_LOWER_BOUND; } diff --git a/sys/net/gnrc/transport_layer/tcp/internal/common.h b/sys/net/gnrc/transport_layer/tcp/internal/common.h index 1b35968e12..c4deb78a02 100644 --- a/sys/net/gnrc/transport_layer/tcp/internal/common.h +++ b/sys/net/gnrc/transport_layer/tcp/internal/common.h @@ -95,7 +95,7 @@ extern "C" { #define RTO_UNINITIALIZED (-1) /** - * @brief Overflow tolerant comparision operators for sequence and + * @brief Overflow tolerant comparison operators for sequence and acknowledgement number comparison. * @{ */ diff --git a/sys/net/gnrc/transport_layer/tcp/internal/fsm.h b/sys/net/gnrc/transport_layer/tcp/internal/fsm.h index ae6f639ec3..8c1c59e869 100644 --- a/sys/net/gnrc/transport_layer/tcp/internal/fsm.h +++ b/sys/net/gnrc/transport_layer/tcp/internal/fsm.h @@ -67,7 +67,7 @@ typedef enum { * * @param[in,out] tcb TCB holding the connection information. * @param[in] event Current event that triggers FSM transition. - * @param[in] in_pkt Incomming packet. Only not NULL in case of event RCVD_PKT. + * @param[in] in_pkt Incoming packet. Only not NULL in case of event RCVD_PKT. * @param[in,out] buf Buffer for send and receive functions. * @param[in] len Number of bytes to send or receive. * diff --git a/sys/net/gnrc/transport_layer/tcp/internal/pkt.h b/sys/net/gnrc/transport_layer/tcp/internal/pkt.h index 1cace73261..b899ef27ba 100644 --- a/sys/net/gnrc/transport_layer/tcp/internal/pkt.h +++ b/sys/net/gnrc/transport_layer/tcp/internal/pkt.h @@ -29,13 +29,13 @@ extern "C" { #endif /** - * @brief Build a reset packet from an incomming packet. + * @brief Build a reset packet from an incoming packet. * - * @note This function builds a reset from an incomming packet + * @note This function builds a reset from an incoming packet * in cases where the connection has not been established. * * @param[out] out_pkt Outgoing reset packet - * @param[in] in_pkt Incomming packet + * @param[in] in_pkt Incoming packet * * @returns Zero on success * -ENOMEM if pktbuf is full. diff --git a/sys/net/routing/nhdp/iib_table.c b/sys/net/routing/nhdp/iib_table.c index fca78e2d2c..256f85500e 100644 --- a/sys/net/routing/nhdp/iib_table.c +++ b/sys/net/routing/nhdp/iib_table.c @@ -448,7 +448,7 @@ static iib_link_set_entry_t *update_link_set(iib_base_entry_t *base_entry, nib_e release_link_tuple_addresses(matching_lt); } else { - /* No single matching link tuple existant, create a new one */ + /* No single matching link tuple existent, create a new one */ matching_lt = add_default_link_set_entry(base_entry, now, val_time); if (!matching_lt) { diff --git a/sys/posix/pthread/include/pthread_rwlock_attr.h b/sys/posix/pthread/include/pthread_rwlock_attr.h index 17723995d1..4d7eac47f6 100644 --- a/sys/posix/pthread/include/pthread_rwlock_attr.h +++ b/sys/posix/pthread/include/pthread_rwlock_attr.h @@ -38,7 +38,7 @@ typedef struct } pthread_rwlockattr_t; /** - * @brief Initilize the attribute set with the defaults. + * @brief Initialize the attribute set with the defaults. * @details Default value for pshared: `PTHREAD_PROCESS_PRIVATE`. * A zeroed out datum is initialized. * @param[in,out] attr Attribute set to initialize. diff --git a/sys/posix/pthread/pthread_rwlock.c b/sys/posix/pthread/pthread_rwlock.c index b644c91afd..2e063132ec 100644 --- a/sys/posix/pthread/pthread_rwlock.c +++ b/sys/posix/pthread/pthread_rwlock.c @@ -261,7 +261,7 @@ int pthread_rwlock_unlock(pthread_rwlock_t *rwlock) } if (rwlock->readers != 0 || rwlock->queue.first == NULL) { - /* this thread was not the last reader, or no one is waiting to aquire the lock */ + /* this thread was not the last reader, or no one is waiting to acquire the lock */ DEBUG("Thread %" PRIkernel_pid ": pthread_rwlock_%s(): no one is waiting\n", thread_getpid(), "unlock"); mutex_unlock(&rwlock->mutex); return 0; diff --git a/sys/random/fortuna/fortuna.h b/sys/random/fortuna/fortuna.h index 5282e8a9a0..06318dfcb0 100755 --- a/sys/random/fortuna/fortuna.h +++ b/sys/random/fortuna/fortuna.h @@ -159,7 +159,7 @@ typedef uint32_t fortuna_seed_t[FORTUNA_SEED_SIZE]; * * @param[inout] state PRNG state * - * @return zero on succesful initialization + * @return zero on successful initialization * @return non-zero on error */ int fortuna_init(fortuna_state_t *state); diff --git a/sys/shell/commands/sc_fib.c b/sys/shell/commands/sc_fib.c index 511a76a396..6e22d13f82 100644 --- a/sys/shell/commands/sc_fib.c +++ b/sys/shell/commands/sc_fib.c @@ -129,7 +129,7 @@ static void _fib_add(const char *dest, const char *next, kernel_pid_t pid, uint3 int _fib_route_handler(int argc, char **argv) { - /* e.g. fibroute right now dont care about the adress/protocol family */ + /* e.g. fibroute right now don't care about the address/protocol family */ if (argc == 1) { fib_print_routes(&gnrc_ipv6_fib_table); return 0; diff --git a/sys/shell/commands/sc_vfs.c b/sys/shell/commands/sc_vfs.c index d5a085a1dd..4fe2af77d1 100644 --- a/sys/shell/commands/sc_vfs.c +++ b/sys/shell/commands/sc_vfs.c @@ -294,7 +294,7 @@ static int _write_handler(int argc, char **argv) } w_buf = argv[4]; nbytes = strlen(w_buf); - /* in hex string mode, bytes may be seperated by spaces */ + /* in hex string mode, bytes may be separated by spaces */ /* in ascii mode, there could be spaces */ /* we need the total number of strings to go through */ nb_str = argc - 4; diff --git a/tests/cortexm_common_ldscript/Makefile b/tests/cortexm_common_ldscript/Makefile index 31d421908c..bbd662a46b 100644 --- a/tests/cortexm_common_ldscript/Makefile +++ b/tests/cortexm_common_ldscript/Makefile @@ -65,7 +65,7 @@ _test-elffile-overflow-runtest: $(BINFILE) # Test `ROM_OFFSET` is removed from firmware rom length if the board defines it test-elffile-fw_rom_length: $(ELFFILE) - $(Q)echo -n "Test rom offset substracted from rom length in elffile: " + $(Q)echo -n "Test rom offset subtracted from rom length in elffile: " $(Q)\ if test -n "$(ROM_OFFSET)"; then \ TEST_FW_LEN=$$($(PREFIX)readelf --symbols $^ 2>/dev/null | awk '/_fw_rom_length/{printf "0x%s\n", $$2}'); \ diff --git a/tests/cortexm_common_ldscript/README.md b/tests/cortexm_common_ldscript/README.md index 5571d4adc4..213ed832c8 100644 --- a/tests/cortexm_common_ldscript/README.md +++ b/tests/cortexm_common_ldscript/README.md @@ -20,7 +20,7 @@ after the normal compilation: make all BOARD=iotlab-m3 ... Test rom offset 1 byte overflow detection: [OK] -Test rom offset substracted from rom length in elffile: [SKIP](Reason: board does not have a ROM_OFFSET configured) +Test rom offset subtracted from rom length in elffile: [SKIP](Reason: board does not have a ROM_OFFSET configured) Test compilation with offset 0x1000: [OK] Test compilation with offset 0x2000: [OK] Test compilation with half ROM length: [OK] @@ -36,7 +36,7 @@ compilation: make BOARD=bluepill PROGRAMMER=dfu-util ... Test rom offset 1 byte overflow detection: [OK] -Test rom offset substracted from rom length in elffile: [OK] +Test rom offset subtracted from rom length in elffile: [OK] Test compilation with offset 0x1000: [OK] Test compilation with offset 0x2000: [OK] Test compilation with half ROM length: [OK] diff --git a/tests/driver_io1_xplained/main.c b/tests/driver_io1_xplained/main.c index 031282f19e..69c41042d3 100644 --- a/tests/driver_io1_xplained/main.c +++ b/tests/driver_io1_xplained/main.c @@ -54,7 +54,7 @@ int main(void) { float temperature; - puts("IO1 Xplained extention test application\n"); + puts("IO1 Xplained extension test application\n"); puts("+-------------Initializing------------+\n"); if (io1_xplained_init(&dev, &io1_xplained_params[0]) != IO1_XPLAINED_OK) { diff --git a/tests/driver_lc709203f/main.c b/tests/driver_lc709203f/main.c index a1cb924825..22ceccb831 100644 --- a/tests/driver_lc709203f/main.c +++ b/tests/driver_lc709203f/main.c @@ -10,7 +10,7 @@ * @ingroup tests * @{ * @file - * @brief test aplication for the LC709203F Battery fuel gauge by on semiconductors + * @brief test application for the LC709203F Battery fuel gauge by on semiconductors * * @author Steffen Robertz * @author Josua Arndt diff --git a/tests/driver_lis2dh12/main.c b/tests/driver_lis2dh12/main.c index ad7255e739..9a47939a1d 100644 --- a/tests/driver_lis2dh12/main.c +++ b/tests/driver_lis2dh12/main.c @@ -28,7 +28,7 @@ #define DELAY (100UL * US_PER_MS) -/* allocate some memory to hold one formated string for each sensor output, so +/* allocate some memory to hold one formatted string for each sensor output, so * one string for the X, Y, and Z reading, respectively */ static char str_out[3][8]; diff --git a/tests/driver_sds011/main.c b/tests/driver_sds011/main.c index 7d5b83c123..78e5cbd76f 100644 --- a/tests/driver_sds011/main.c +++ b/tests/driver_sds011/main.c @@ -98,7 +98,7 @@ int main(void) puts("init [OK]"); } else { - puts("initalization [ERROR]"); + puts("initialization [ERROR]"); return -1; } diff --git a/tests/driver_srf08/main.c b/tests/driver_srf08/main.c index 3e0cddd769..138e27c61a 100644 --- a/tests/driver_srf08/main.c +++ b/tests/driver_srf08/main.c @@ -74,7 +74,7 @@ int main(void) } else { - puts("An error occured"); + puts("An error occurred"); } xtimer_usleep(SLEEP_USEC); } diff --git a/tests/driver_tps6274x/README.md b/tests/driver_tps6274x/README.md index d967b494e7..b5bcec37f6 100644 --- a/tests/driver_tps6274x/README.md +++ b/tests/driver_tps6274x/README.md @@ -8,4 +8,4 @@ Build the test by using the `make BOARD=??? flash` command in the `test/driver_t The stepdown converter will step from 1.8V to 3.3V in 100mV steps. Each voltage will be set for 3 seconds and can be measured at the VOUT Pin. After 1 second also the LOAD output pin will be enabled for 2 seconds -untill the next voltage is set. +until the next voltage is set. diff --git a/tests/gnrc_sock_ip/stack.h b/tests/gnrc_sock_ip/stack.h index 88b9849d03..4438096171 100644 --- a/tests/gnrc_sock_ip/stack.h +++ b/tests/gnrc_sock_ip/stack.h @@ -50,7 +50,7 @@ void _prepare_send_checks(void); * @param[in] netif The interface the packet came over * * @return true, if packet was successfully injected - * @return false, if an error occured during injection + * @return false, if an error occurred during injection */ bool _inject_packet(const ipv6_addr_t *src, const ipv6_addr_t *dst, uint8_t proto, void *data, size_t data_len, diff --git a/tests/gnrc_sock_udp/stack.h b/tests/gnrc_sock_udp/stack.h index d38f314103..73aaf6b3e5 100644 --- a/tests/gnrc_sock_udp/stack.h +++ b/tests/gnrc_sock_udp/stack.h @@ -51,7 +51,7 @@ void _prepare_send_checks(void); * @param[in] netif The interface the packet came over * * @return true, if packet was successfully injected - * @return false, if an error occured during injection + * @return false, if an error occurred during injection */ bool _inject_packet(const ipv6_addr_t *src, const ipv6_addr_t *dst, uint16_t src_port, uint16_t dst_port, diff --git a/tests/pkg_fatfs/README.md b/tests/pkg_fatfs/README.md index 21fdf806e9..6ce0ad9724 100644 --- a/tests/pkg_fatfs/README.md +++ b/tests/pkg_fatfs/README.md @@ -6,7 +6,7 @@ Using FatFs on RIOT To use this test on native you can either use a FAT-formatted image file or directly use the mkfs command from the RIOT shell. Use `make image` to extract a prepared image file that already contains a simple test.txt file. This is -only a convinience function to allow testing against a "default linux" +only a convenience function to allow testing against a "default linux" formatted fat volume without the need to call mount or other stuff that may require super user privileges. Optionally `make compressed-image` can be used to generate the compressed image that is in turn used by `make image`. diff --git a/tests/pkg_fatfs_vfs/README.md b/tests/pkg_fatfs_vfs/README.md index 3c5995c734..9b6a94cf0f 100644 --- a/tests/pkg_fatfs_vfs/README.md +++ b/tests/pkg_fatfs_vfs/README.md @@ -6,7 +6,7 @@ Using FatFs (with VFS) on RIOT To use this test on native you can either use a FAT-formatted image file or directly use the mkfs command from the RIOT shell. Use `make image` to extract a prepared image file that already contains a simple test.txt file. This is -only a convinience function to allow testing against a "default linux" +only a convenience function to allow testing against a "default linux" formatted fat volume without the need to call mount or other stuff that may require super user privileges. Optionally `make compressed-image` can be used to generate the compressed image that is in turn used by `make image`. diff --git a/tests/pkg_semtech-loramac/README.md b/tests/pkg_semtech-loramac/README.md index 82e87783b8..1325a7a9fb 100644 --- a/tests/pkg_semtech-loramac/README.md +++ b/tests/pkg_semtech-loramac/README.md @@ -93,7 +93,7 @@ is activated by default. ### Joining with Activation By Personalization -OTAA is always prefered in real world scenarios. +OTAA is always preferred in real world scenarios. However, ABP can be practical for testing or workshops. * Set your Device Address, Network Session Key , Application Session Key: @@ -199,7 +199,7 @@ After sending some data from the node, the subscribed MQTT client will display: {"app_id":"","dev_id":"","hardware_serial":"XXXXXXXXXXXX","port":2,"counter":7,"confirmed":true,"payload_raw":"dGVzdA==","metadata": {"time":"2017-12-14T09:47:24.84548586Z","frequency":868.1,"modulation":"LORA","data_rate":"SF12BW125","coding_rate":"4/5","gateways":[{"gtw_id":"eui-xxxxxxxx","timestamp":3910359076, "time":"2017-12-14T09:47:24.85112Z","channel":0,"rssi":-10,"snr":12.2,"rf_chain":1,"latitude":48.715027,"longitude":2.2059395,"altitude":157,"location_source":"registry"}]}} -The payload sent is in the `payload_raw` json field and is formated in base64 +The payload sent is in the `payload_raw` json field and is formatted in base64 (`dGVzdA==` in this example). The node will also print the data received: diff --git a/tests/pkg_tiny-asn1/README.md b/tests/pkg_tiny-asn1/README.md index b981f85962..f155844142 100644 --- a/tests/pkg_tiny-asn1/README.md +++ b/tests/pkg_tiny-asn1/README.md @@ -2,5 +2,5 @@ This test tries to execute all basic functions of the tiny-asn1 library by decoding and encoding some data. -If everything works, the programs exits with a return code of 1 and prints "Decoding finished succesfully" at the end. +If everything works, the programs exits with a return code of 1 and prints "Decoding finished successfully" at the end. In case of an error, the program returns with an exit code of 1. diff --git a/tests/pkg_tiny-asn1/main.c b/tests/pkg_tiny-asn1/main.c index c6d390054e..3392dc9c6a 100644 --- a/tests/pkg_tiny-asn1/main.c +++ b/tests/pkg_tiny-asn1/main.c @@ -203,6 +203,6 @@ int main(void) free(asn1_objects); /* Everything worked fine */ - printf("Decoding finished succesfully\n"); + printf("Decoding finished successfully\n"); return 0; } diff --git a/tests/riotboot/tests/common/assert_slotnum.py b/tests/riotboot/tests/common/assert_slotnum.py index c7e9272b0a..6d1ccdc40a 100755 --- a/tests/riotboot/tests/common/assert_slotnum.py +++ b/tests/riotboot/tests/common/assert_slotnum.py @@ -27,7 +27,7 @@ def testfunc(child): child.sendline("curslothdr") # Magic number is "RIOT" (always in little endian) child.expect_exact("Image magic_number: 0x544f4952") - # Other info is hardware/app dependant so we just check basic compliance + # Other info is hardware/app dependent so we just check basic compliance child.expect("Image Version: %s" % ("{0:#0{1}x}".format(app_ver, 10))) child.expect("Image start address: 0x[0-9a-fA-F]{8}") child.expect("Header chksum: 0x[0-9a-fA-F]{8}") diff --git a/tests/rng/main.c b/tests/rng/main.c index 621c618f6d..8ba8828e73 100644 --- a/tests/rng/main.c +++ b/tests/rng/main.c @@ -28,7 +28,7 @@ #include "test.h" /* - * Foward declarations + * Forward declarations */ static int cmd_distributions(int argc, char **argv); static int cmd_dump(int argc, char **argv); diff --git a/tests/sys_irq_handler/main.c b/tests/sys_irq_handler/main.c index c867233375..f522aa3f59 100644 --- a/tests/sys_irq_handler/main.c +++ b/tests/sys_irq_handler/main.c @@ -23,7 +23,7 @@ * * To be able to simulate the interrupts by the main thread, the interrupt * handler thread has to have a lower priority as the main thread for this - * example. Otherwise, the interrupts would be handled immediatly when they + * example. Otherwise, the interrupts would be handled immediately when they * are generated by the main thread. Therefore the interrupt handler thread * priority is set to THREAD_PRIORITY_MAIN+1 for this example. * @} diff --git a/tests/unittests/tests-gnrc_ipv6_nib/tests-gnrc_ipv6_nib-internal.c b/tests/unittests/tests-gnrc_ipv6_nib/tests-gnrc_ipv6_nib-internal.c index a171d3c2a1..166aefb147 100644 --- a/tests/unittests/tests-gnrc_ipv6_nib/tests-gnrc_ipv6_nib-internal.c +++ b/tests/unittests/tests-gnrc_ipv6_nib/tests-gnrc_ipv6_nib-internal.c @@ -476,7 +476,7 @@ static void test_nib_nc_add__success(void) } /* - * Creates GNRC_IPV6_NIB_NUMOF neighbor cache entries with differnt IP address. + * Creates GNRC_IPV6_NIB_NUMOF neighbor cache entries with different IP address. * Expected result: new entries should still be able to be created and further * should be different than the previous created ones */ diff --git a/tests/unittests/tests-inet_csum/tests-inet_csum.c b/tests/unittests/tests-inet_csum/tests-inet_csum.c index ebb40e6e04..b47e766765 100644 --- a/tests/unittests/tests-inet_csum/tests-inet_csum.c +++ b/tests/unittests/tests-inet_csum/tests-inet_csum.c @@ -156,7 +156,7 @@ static void test_inet_csum__empty_app_buffer(void) uint16_t hdr_sum, pyld_sum, hdr_expected = 0xdcfc; /* result unnormalized: - * explictly using an odd-sized header for the first slice, to setup corner case */ + * explicitly using an odd-sized header for the first slice, to setup corner case */ hdr_sum = inet_csum_slice(0, data_hdr, sizeof(data_hdr), 0); TEST_ASSERT_EQUAL_INT(hdr_expected, hdr_sum); diff --git a/tests/unittests/tests-pkt/tests-pkt.c b/tests/unittests/tests-pkt/tests-pkt.c index f127207c71..7f0fbfcb1c 100644 --- a/tests/unittests/tests-pkt/tests-pkt.c +++ b/tests/unittests/tests-pkt/tests-pkt.c @@ -147,7 +147,7 @@ static void test_pktsnip_search_type(void) gnrc_pktsnip_t snip1 = _INIT_ELEM_STATIC_TYPE(GNRC_NETTYPE_UNDEF, NULL); gnrc_pktsnip_t snip2 = _INIT_ELEM_STATIC_TYPE(GNRC_NETTYPE_TEST, &snip1); gnrc_pktsnip_t snip3 = _INIT_ELEM_STATIC_TYPE(GNRC_NETTYPE_IPV6, &snip2); - /* successfull searches */ + /* successful searches */ gnrc_pktsnip_t *res; TEST_ASSERT_NOT_NULL((res = gnrc_pktsnip_search_type(&snip3, GNRC_NETTYPE_UNDEF))); TEST_ASSERT_EQUAL_INT(GNRC_NETTYPE_UNDEF, res->type); diff --git a/tests/warn_conflict/README.md b/tests/warn_conflict/README.md index b274230efd..dcffabf09c 100644 --- a/tests/warn_conflict/README.md +++ b/tests/warn_conflict/README.md @@ -1,6 +1,6 @@ Test warning on conflicting features ================================================== -Using conflicting features provided by boards was invisible for the user until the used features resulted in a traceable problem or the user was aware of the conflict in advance from documentation ect. +Using conflicting features provided by boards was invisible for the user until the used features resulted in a traceable problem or the user was aware of the conflict in advance from documentation etc. Now, existing and known conflicts can be recorded into `FEATURES_CONFLICT` for each board to inform the user on a conflict situation during compile time. This test requires conflicting features in its `Makefile`, i.e. `FEATURES_REQUIRED = periph_dac periph_spi`. diff --git a/tests/xtimer_hang/README.md b/tests/xtimer_hang/README.md index 95e21d227f..907594349a 100644 --- a/tests/xtimer_hang/README.md +++ b/tests/xtimer_hang/README.md @@ -13,10 +13,10 @@ deadlock, it is not about clock stability nor accuracy of timing intervals. When debug pins are used and observed the expected output is as follows: The MAIN_THREAD_PIN is on for ca. 100ms and that in a regular interval. If this interval is not regular or has gaps this is an error. The WORKER_THREAD_PIN should toggle after 1ms and 1.1ms. (As this might fall in the XTIMER_ISR_BACKOFF the -first pin toggle is delayed untill the second is ready. Thus the time interval can be longer.) +first pin toggle is delayed until the second is ready. Thus the time interval can be longer.) If the Timer fall in the same interrupt there might be a interrupt before the second worker thread timer is set. This leads to a separation of the timer interrupts until they again fall in the same interrupt. -It might happen that from the seperation of the interrupts till the merge there is only a uneven count of +It might happen that from the separation of the interrupts till the merge there is only a uneven count of WORKER_THREAD_PIN toggles, which means a loss of one worker time 2, which is expected as it has a lower priority then worker timer 1. And thus in the moment when the hardware interrupt for the 2 worker is executet it has to wait for the 1 worker timer because of the XTIMER_ISR_BACKOFF and so the first timer is executed first as it has the higher priority. \ No newline at end of file diff --git a/tests/xtimer_mutex_lock_timeout/main.c b/tests/xtimer_mutex_lock_timeout/main.c index dcb140c4f5..c96f32ccbd 100644 --- a/tests/xtimer_mutex_lock_timeout/main.c +++ b/tests/xtimer_mutex_lock_timeout/main.c @@ -32,7 +32,7 @@ static kernel_pid_t main_thread_pid; /** - * Foward declarations + * Forward declarations */ static int cmd_test_xtimer_mutex_lock_timeout_long_unlocked(int argc, char **argv);