Skip to content

Commit c2e5e13

Browse files
committed
Update indent.
Signed-off-by: Lei Liu <[email protected]>
1 parent a190752 commit c2e5e13

File tree

1 file changed

+24
-24
lines changed

1 file changed

+24
-24
lines changed
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
// Copyright 2014 Open Source Robotics Foundation, Inc.
1+
// Copyright 2021 Open Source Robotics Foundation, Inc.
22
//
33
// Licensed under the Apache License, Version 2.0 (the "License");
44
// you may not use this file except in compliance with the License.
@@ -20,34 +20,34 @@
2020

2121
namespace demo_nodes_cpp
2222
{
23-
// Create a Listener class that subclasses the generic rclcpp::Node base class.
24-
// The main function below will instantiate the class as a ROS node.
25-
class LoanedMessageListener : public rclcpp::Node
23+
// Create a Listener class that subclasses the generic rclcpp::Node base class.
24+
// The main function below will instantiate the class as a ROS node.
25+
class LoanedMessageListener : public rclcpp::Node
26+
{
27+
public:
28+
DEMO_NODES_CPP_PUBLIC
29+
explicit LoanedMessageListener(const rclcpp::NodeOptions & options)
30+
: Node("listener_loaned_message", options)
2631
{
27-
public:
28-
DEMO_NODES_CPP_PUBLIC
29-
explicit LoanedMessageListener(const rclcpp::NodeOptions &options)
30-
: Node("listener_loaned_message", options)
31-
{
32-
// Create a callback function for when messages are received.
33-
// Variations of this function also exist using, for example UniquePtr for zero-copy transport.
34-
setvbuf(stdout, NULL, _IONBF, BUFSIZ);
35-
auto callback =
36-
[this](const std_msgs::msg::Float64::SharedPtr msg) -> void
32+
// Create a callback function for when messages are received.
33+
// Variations of this function also exist using, for example UniquePtr for zero-copy transport.
34+
setvbuf(stdout, NULL, _IONBF, BUFSIZ);
35+
auto callback =
36+
[this](const std_msgs::msg::Float64::SharedPtr msg) -> void
3737
{
3838
RCLCPP_INFO(this->get_logger(), "I heard: [%f]", msg->data);
3939
};
40-
// Create a subscription to the topic which can be matched with one or more compatible ROS
41-
// publishers.
42-
// Note that not all publishers on the same topic with the same type will be compatible:
43-
// they must have compatible Quality of Service policies.
44-
sub_ = create_subscription<std_msgs::msg::Float64>("chatter_pod", 10, callback);
45-
}
40+
// Create a subscription to the topic which can be matched with one or more compatible ROS
41+
// publishers.
42+
// Note that not all publishers on the same topic with the same type will be compatible:
43+
// they must have compatible Quality of Service policies.
44+
sub_ = create_subscription<std_msgs::msg::Float64>("chatter_pod", 10, callback);
45+
}
4646

47-
private:
48-
rclcpp::Subscription<std_msgs::msg::Float64>::SharedPtr sub_;
49-
};
47+
private:
48+
rclcpp::Subscription<std_msgs::msg::Float64>::SharedPtr sub_;
49+
};
5050

51-
} // namespace demo_nodes_cpp
51+
} // namespace demo_nodes_cpp
5252

5353
RCLCPP_COMPONENTS_REGISTER_NODE(demo_nodes_cpp::LoanedMessageListener)

0 commit comments

Comments
 (0)