Skip to content

Commit a7d891f

Browse files
committed
Uncrustify
Signed-off-by: Patrick Roncagliolo <ronca.pat@gmail.com>
1 parent 623ed83 commit a7d891f

File tree

3 files changed

+5
-3
lines changed

3 files changed

+5
-3
lines changed

rclcpp/src/rclcpp/node.cpp

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -214,7 +214,8 @@ Node::Node(
214214
options.automatically_declare_parameters_from_overrides()
215215
)),
216216
node_time_source_(
217-
options.time_source() ? options.time_source() : std::make_shared<rclcpp::node_interfaces::NodeTimeSource>(
217+
options.time_source() ? options.time_source() :
218+
std::make_shared<rclcpp::node_interfaces::NodeTimeSource>(
218219
node_base_,
219220
node_topics_,
220221
node_graph_,

rclcpp/src/rclcpp/node_interfaces/node_time_source.cpp

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -48,7 +48,8 @@ NodeTimeSource::NodeTimeSource(
4848
node_parameters_);
4949
}
5050

51-
void NodeTimeSource::attachClock(rclcpp::node_interfaces::NodeClockInterface::SharedPtr clock){
51+
void NodeTimeSource::attachClock(rclcpp::node_interfaces::NodeClockInterface::SharedPtr clock)
52+
{
5253
time_source_.attachClock(clock->get_clock());
5354
}
5455

rclcpp/src/rclcpp/node_options.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -408,7 +408,7 @@ NodeOptions &
408408
NodeOptions::time_source(rclcpp::node_interfaces::NodeTimeSourceInterface::SharedPtr time_source)
409409
{
410410
this->time_source_ = time_source;
411-
return *this;
411+
return *this;
412412
}
413413

414414
} // namespace rclcpp

0 commit comments

Comments
 (0)