Skip to content

Commit

Permalink
CPPLINT: remove legal/copyright rule
Browse files Browse the repository at this point in the history
  • Loading branch information
khancyr committed Jul 31, 2024
1 parent f2e31d5 commit 0624167
Showing 1 changed file with 10 additions and 6 deletions.
16 changes: 10 additions & 6 deletions CPPLINT.cfg
Original file line number Diff line number Diff line change
Expand Up @@ -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
Expand Down Expand Up @@ -49,8 +49,12 @@
# 7. [-build/c++11], [+build/c++14]
#
# This is to allow headers not approved for C++11 such as <chrono> 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

0 comments on commit 0624167

Please sign in to comment.