Skip to content

Commit

Permalink
Reformat some code to make uncrustify happier. (#654)
Browse files Browse the repository at this point in the history
This new formatting makes both uncrustify 0.72 and 0.78
happy.

Signed-off-by: Chris Lalancette <clalancette@gmail.com>
  • Loading branch information
clalancette authored Feb 26, 2024
1 parent 4a46a8f commit 294cf92
Showing 1 changed file with 4 additions and 2 deletions.
6 changes: 4 additions & 2 deletions tf2_ros/include/tf2_ros/message_filter.h
Original file line number Diff line number Diff line change
Expand Up @@ -167,7 +167,8 @@ class MessageFilter : public MessageFilterBase, public message_filters::SimpleFi
const rclcpp::Node::SharedPtr & node,
std::chrono::duration<TimeRepT, TimeT> buffer_timeout =
std::chrono::duration<TimeRepT, TimeT>::max())
: MessageFilter(buffer, target_frame, queue_size, node->get_node_logging_interface(),
: MessageFilter(
buffer, target_frame, queue_size, node->get_node_logging_interface(),
node->get_node_clock_interface(), buffer_timeout)
{
static_assert(
Expand Down Expand Up @@ -221,7 +222,8 @@ class MessageFilter : public MessageFilterBase, public message_filters::SimpleFi
const rclcpp::Node::SharedPtr & node,
std::chrono::duration<TimeRepT, TimeT> buffer_timeout =
std::chrono::duration<TimeRepT, TimeT>::max())
: MessageFilter(f, buffer, target_frame, queue_size, node->get_node_logging_interface(),
: MessageFilter(
f, buffer, target_frame, queue_size, node->get_node_logging_interface(),
node->get_node_clock_interface(), buffer_timeout)
{
}
Expand Down

0 comments on commit 294cf92

Please sign in to comment.