Skip to content

Commit

Permalink
Merge branch 'master' of github.com:apache/incubator-nuttx
Browse files Browse the repository at this point in the history
  • Loading branch information
davids5 committed Feb 7, 2020
2 parents 4b529f5 + 3b311ab commit 5e9ad05
Show file tree
Hide file tree
Showing 197 changed files with 12,798 additions and 861 deletions.
4 changes: 2 additions & 2 deletions ChangeLog
Original file line number Diff line number Diff line change
Expand Up @@ -15767,7 +15767,7 @@
Other TCP-specific issues also fixed. There remains a major
outstanding issue with ACK handling. Handle case where the local
address is zero (listen socket). Major re-architecting of TCP logic
to properly handle TCP stuf like ACKs and TPC windowing which were
to properly handle TCP stuf like ACKs and TCP windowing which were
not properly covered in the initial design. Still does not work;
hangs waiting of ACKs.Various fixes for a clean build if either TCP
or UDP are disabled. Given the current state of TCP, it is
Expand Down Expand Up @@ -17528,7 +17528,7 @@
use file-system in between. NOTE that this provides the opposite
capability of FTL which will let you use an MTD interface directly as a
block device. From Jussi Kivilinna (2017-10-19).
* There was a reference counting problem in the TPC logic of
* There was a reference counting problem in the TCP logic of
net_clone(). net_clone() which is the common logic underlying dup() and
dup2() for sockets. When net_clone() calls net_start_monitor() and
net_start_monitor() returns a failure (because the underlying TCP
Expand Down
88 changes: 29 additions & 59 deletions Documentation/NuttXCCodingStandard.html
Original file line number Diff line number Diff line change
Expand Up @@ -87,7 +87,7 @@ <h1>Table of Contents</h1>
<h1><big><font color="#3c34ec">
<i>NuttX C Coding Standard</i>
</font></big></h1>
<p>Last Updated: January 2, 2020</p>
<p>Last Updated: February 2, 2020</p>
</td>
</tr>
</table>
Expand Down Expand Up @@ -132,15 +132,15 @@ <h2>1.1 <a name="fileorganization">File Organization</a></h2>
<li>
A blank line</li>
<li>
Standard (modified) BSD licensing information.
NuttX standard Apache 2.0 licensing information as provided in the <a href="#appndxa">appendix</a>.
</li>
</ul>
<p>
<b>Sample File Headers</b>.
Sample file headers are provided in an <a href="#appndxa">Appendix</a> to this document.
No software may be included in the NuttX source tree that does not have licensing information included in the file.
No software may be included in the NuttX source tree that does not have a (modified) BSD license or compatible license (such as the MIT license).
If the file does not following BSD licensing, then the appropriate license information should be provided in the header rather than the (modified) BSD licensing information and a NOTE should be included in the top-level <code>COPYING</code> file to indicate any variations from (modified) BSD licensing.
No new software may be included in the NuttX source tree that does not have licensing information included in the file.
No new software may be included in the NuttX source tree that does not have a Apache 2.0 license or license (or, in the case of 3rd party file, a compatible license such as the BSD or MIT licenses).
If the file does not follow Apache 2.0 licensing, then the appropriate license information should be provided in the header rather than the Apache 2.0 licensing information and a NOTE should be included in the top-level <code>COPYING</code> file to indicate any variations from Apache 2.0 licensing.
</p>
<p>
<b>Grouping</b>.
Expand Down Expand Up @@ -2888,35 +2888,20 @@ <h2><a name="cfilestructure">A.1 C Source File Structure</a></h2>
* <i>&lt;Relative path to the file&gt;</i>
* <i>&lt;Optional one line file description&gt;</i>
*
* Copyright (C) <i>&lt;Year&gt;</i> <i>&lt;Copyright holder's name&gt;</i>. All rights reserved.
* Author: <i>&lt;Author's name&gt;</i> <i>&lt;Contact e-mail&gt;</i>
* Licensed to the Apache Software Foundation (ASF) under one or more
* contributor license agreements. See the NOTICE file distributed with
* this work for additional information regarding copyright ownership. The
* ASF licenses this file to you under the Apache License, Version 2.0 (the
* "License"); you may not use this file except in compliance with the
* License. You may obtain a copy of the License at
*
* Redistribution and use in source and binary forms, with or without
* modification, are permitted provided that the following conditions
* are met:
* http://www.apache.org/licenses/LICENSE-2.0
*
* 1. Redistributions of source code must retain the above copyright
* notice, this list of conditions and the following disclaimer.
* 2. Redistributions in binary form must reproduce the above copyright
* notice, this list of conditions and the following disclaimer in
* the documentation and/or other materials provided with the
* distribution.
* 3. Neither the name NuttX nor the names of its contributors may be
* used to endorse or promote products derived from this software
* without specific prior written permission.
*
* THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
* "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
* LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
* FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
* COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
* INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
* BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS
* OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED
* AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
* LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
* ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
* POSSIBILITY OF SUCH DAMAGE.
* Unless required by applicable law or agreed to in writing, software
* distributed under the License is distributed on an "AS IS" BASIS, WITHOUT
* WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. See the
* License for the specific language governing permissions and limitations
* under the License.
*
****************************************************************************/

Expand Down Expand Up @@ -3014,35 +2999,20 @@ <h2><a name="hfilestructure">A.2 C Header File Structure</a></h2>
* <i>&lt;Relative path to the file&gt;</i>
* <i>&lt;Optional one line file description&gt;</i>
*
* Copyright (C) <i>&lt;Year&gt;</i> <i>&lt;Copyright holder's name&gt;</i>. All rights reserved.
* Author: <i>&lt;Author's name&gt;</i> <i>&lt;Contact e-mail&gt;</i>
*
* Redistribution and use in source and binary forms, with or without
* modification, are permitted provided that the following conditions
* are met:
* Licensed to the Apache Software Foundation (ASF) under one or more
* contributor license agreements. See the NOTICE file distributed with
* this work for additional information regarding copyright ownership. The
* ASF licenses this file to you under the Apache License, Version 2.0 (the
* "License"); you may not use this file except in compliance with the
* License. You may obtain a copy of the License at
*
* 1. Redistributions of source code must retain the above copyright
* notice, this list of conditions and the following disclaimer.
* 2. Redistributions in binary form must reproduce the above copyright
* notice, this list of conditions and the following disclaimer in
* the documentation and/or other materials provided with the
* distribution.
* 3. Neither the name NuttX nor the names of its contributors may be
* used to endorse or promote products derived from this software
* without specific prior written permission.
* http://www.apache.org/licenses/LICENSE-2.0
*
* THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
* "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
* LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
* FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
* COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
* INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
* BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS
* OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED
* AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
* LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
* ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
* POSSIBILITY OF SUCH DAMAGE.
* Unless required by applicable law or agreed to in writing, software
* distributed under the License is distributed on an "AS IS" BASIS, WITHOUT
* WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. See the
* License for the specific language governing permissions and limitations
* under the License.
*
****************************************************************************/
</pre>
Expand Down
4 changes: 2 additions & 2 deletions ReleaseNotes
Original file line number Diff line number Diff line change
Expand Up @@ -16312,7 +16312,7 @@ detailed bugfix information):
- sockgetname() files need to include udp/udp.h and tcp/tcp.h or
otherwise NET_UDP_HAVE_STACK and NET_TCP_HAVE_STACK are undefined
and the logic is never compiled. Noted by Anthony Merlino.
- dup()/dup2(): There was a reference counting problem in the TPC
- dup()/dup2(): There was a reference counting problem in the TCP
logic of net_clone(). net_clone() which is the common logic
underlying dup() and dup2() for sockets. When net_clone() calls
net_start_monitor() and net_start_monitor() returns a failure
Expand Down Expand Up @@ -20236,7 +20236,7 @@ detailed bugfix information):
multicast address. Exiting logic only supported UDP multicast. But
MLD and certain other ICMPv6 packets also require acceptance of
multicast packets. From Gregory Nutt.
- TCP: In TPC recv window calculations, in order to receive data we
- TCP: In TCP recv window calculations, in order to receive data we
must not only have IOBs available, but we must also have at least one
IOB chain qentry available. Otherwise, we will advertise that we an
buffer a lot of data when, in fact, we cannot. This is an
Expand Down
6 changes: 3 additions & 3 deletions arch/arm/include/s32k1xx/irq.h
Original file line number Diff line number Diff line change
Expand Up @@ -46,10 +46,10 @@

#include <nuttx/config.h>

#if defined(CONFIG_ARCH_CHIP_S32K11X)
# include <arch/chip/s32k11x_irq.h>
#elif defined(CONFIG_ARCH_CHIP_S32K14X)
#if defined(CONFIG_ARCH_CHIP_S32K14X)
# include <arch/chip/s32k14x_irq.h>
#elif defined(CONFIG_ARCH_CHIP_S32K11X)
# include <arch/chip/s32k11x_irq.h>
#else
# error Unrecognized S32K1XX part
#endif
Expand Down
21 changes: 20 additions & 1 deletion arch/arm/include/stm32f0l0g0/chip.h
Original file line number Diff line number Diff line change
Expand Up @@ -50,7 +50,26 @@

/* Get customizations for each supported chip */

#if defined(CONFIG_ARCH_CHIP_STM32F051R8)
#if defined(CONFIG_ARCH_CHIP_STM32F030RC || CONFIG_ARCH_CHIP_STM32F030CC)

# define STM32_FLASH_SIZE (256*1024) /* 256Kb */
# define STM32_SRAM_SIZE (32*1024) /* 32Kb */

# define STM32_NSPI 2 /* Two SPI modules (SPI or I2S) */
# define STM32_NI2S 0 /* No I2S modules */
# define STM32_NI2C 2 /* Two I2C modules */
# define STM32_NDMA 1 /* 1 DMA1, 7-channels */
# define STM32_NUSART 6 /* Six USARTs modules */
# define STM32_NCAN 0 /* No CAN controllers */
# define STM32_NUSBDEV 0 /* One USB full-speed device controller */
# define STM32_NUSBOTG 0 /* No USB OTG FS/HS (only USB 2.0 device) */
# define STM32_NADC 1 /* One 12-bit module */
# define STM32_NDAC 0 /* One DAC channel */
# define STM32_NCOMP 0 /* Two Analog Comparators */
# define STM32_NCAP 0 /* Capacitive sensing channels (14 on UFQFPN32)) */
# define STM32_NPORTS 5 /* Six GPIO ports, GPIOA-F */

#elif defined(CONFIG_ARCH_CHIP_STM32F051R8)

# define STM32_FLASH_SIZE (64*1024) /* 64Kb */
# define STM32_SRAM_SIZE (8*1024) /* 8Kb */
Expand Down
2 changes: 1 addition & 1 deletion arch/arm/src/common/up_initialize.c
Original file line number Diff line number Diff line change
Expand Up @@ -247,7 +247,7 @@ void up_initialize(void)
up_netinitialize();
#endif

#ifdef CONFIG_NETDEV_LOOPBACK
#ifdef CONFIG_NET_LOOPBACK
/* Initialize the local loopback device */

localhost_initialize();
Expand Down
6 changes: 4 additions & 2 deletions arch/arm/src/imxrt/imxrt_lpi2c.c
Original file line number Diff line number Diff line change
Expand Up @@ -1118,7 +1118,8 @@ static void imxrt_lpi2c_setclock(FAR struct imxrt_lpi2c_priv_s *priv,
}
}

imxrt_lpi2c_modifyreg(priv, IMXRT_LPI2C_MCFGR1_OFFSET, 0,
imxrt_lpi2c_modifyreg(priv, IMXRT_LPI2C_MCFGR1_OFFSET,
LPI2C_MCFGR1_PRESCALE_MASK,
LPI2C_MCFGR1_PRESCALE(best_prescale));

/* Re-enable LPI2C if it was enabled previously */
Expand Down Expand Up @@ -1304,7 +1305,8 @@ static int imxrt_lpi2c_isr_process(struct imxrt_lpi2c_priv_s *priv)

if ((priv->msgv->flags & I2C_M_NOSTART) == 0)
{
imxrt_lpi2c_traceevent(priv, I2CEVENT_STARTRESTART, priv->msgc);
imxrt_lpi2c_traceevent(priv, I2CEVENT_STARTRESTART,
priv->msgc);
imxrt_lpi2c_sendstart(priv, priv->msgv->addr);
}
else
Expand Down
Loading

0 comments on commit 5e9ad05

Please sign in to comment.