From 0624167572e25beca738b14e98afa546d370d455 Mon Sep 17 00:00:00 2001 From: Pierre Kancir Date: Thu, 1 Aug 2024 01:10:18 +0200 Subject: [PATCH] CPPLINT: remove legal/copyright rule --- CPPLINT.cfg | 16 ++++++++++------ 1 file changed, 10 insertions(+), 6 deletions(-) diff --git a/CPPLINT.cfg b/CPPLINT.cfg index 24eb31c..367f059 100644 --- a/CPPLINT.cfg +++ b/CPPLINT.cfg @@ -4,20 +4,20 @@ # { should almost always be at the end of the previous line # # Allow: -# bool SocketAPM::pollout(uint32_t timeout_ms) +# bool SocketUDP::pollin(uint32_t timeout_ms) # { # # Instead of: -# bool SocketAPM::pollout(uint32_t timeout_ms) { +# bool SocketUDP::pollin(uint32_t timeout_ms) { # # 2. [-runtime/references] # Is this a non-const reference? If so, make const or use a pointer # # Allow: -# void last_recv_address(const char *&ip_addr, uint16_t &port); +# void get_client_address(const char *&ip_addr, uint16_t &port); # # Instead of: -# void last_recv_address(const char *&ip_addr, uint16_t *port); +# void get_client_address(const char *&ip_addr, uint16_t *port); # # 3. [-whitespace/indent] # private: should be indented +1 space @@ -49,8 +49,12 @@ # 7. [-build/c++11], [+build/c++14] # # This is to allow headers not approved for C++11 such as etc. -# +# +# 8. [-legal/copyright] +# Do not require a copyright header in each file +# + set noparent -filter=-whitespace/braces,-runtime/references,-whitespace/indent,-whitespace/blank_line,-whitespace/newline,-build/include_subdir,-build/c++11,+build/c++14 +filter=-whitespace/braces,-runtime/references,-whitespace/indent,-whitespace/blank_line,-whitespace/newline,-build/include_subdir,-build/c++11,+build/c++14,-legal/copyright linelength=80 root=include