Skip to content

Commit

Permalink
Uncrustify
Browse files Browse the repository at this point in the history
Signed-off-by: Patrick Roncagliolo <[email protected]>
  • Loading branch information
roncapat committed Nov 13, 2024
1 parent 623ed83 commit a7d891f
Show file tree
Hide file tree
Showing 3 changed files with 5 additions and 3 deletions.
3 changes: 2 additions & 1 deletion rclcpp/src/rclcpp/node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -214,7 +214,8 @@ Node::Node(
options.automatically_declare_parameters_from_overrides()
)),
node_time_source_(
options.time_source() ? options.time_source() : std::make_shared<rclcpp::node_interfaces::NodeTimeSource>(
options.time_source() ? options.time_source() :
std::make_shared<rclcpp::node_interfaces::NodeTimeSource>(
node_base_,
node_topics_,
node_graph_,
Expand Down
3 changes: 2 additions & 1 deletion rclcpp/src/rclcpp/node_interfaces/node_time_source.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -48,7 +48,8 @@ NodeTimeSource::NodeTimeSource(
node_parameters_);
}

void NodeTimeSource::attachClock(rclcpp::node_interfaces::NodeClockInterface::SharedPtr clock){
void NodeTimeSource::attachClock(rclcpp::node_interfaces::NodeClockInterface::SharedPtr clock)
{
time_source_.attachClock(clock->get_clock());
}

Expand Down
2 changes: 1 addition & 1 deletion rclcpp/src/rclcpp/node_options.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -408,7 +408,7 @@ NodeOptions &
NodeOptions::time_source(rclcpp::node_interfaces::NodeTimeSourceInterface::SharedPtr time_source)
{
this->time_source_ = time_source;
return *this;
return *this;
}

} // namespace rclcpp

0 comments on commit a7d891f

Please sign in to comment.