Skip to content

Commit

Permalink
Fix code style
Browse files Browse the repository at this point in the history
  • Loading branch information
Esteve Fernandez committed Apr 20, 2015
1 parent e531758 commit 4fa5422
Show file tree
Hide file tree
Showing 2 changed files with 2 additions and 2 deletions.
2 changes: 1 addition & 1 deletion rclcpp/include/rclcpp/executors.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -26,7 +26,7 @@ namespace executors
using rclcpp::executors::multi_threaded_executor::MultiThreadedExecutor;
using rclcpp::executors::single_threaded_executor::SingleThreadedExecutor;

template <typename FutureT>
template<typename FutureT>
std::shared_future<FutureT> &
spin_node_until_future_complete(
rclcpp::executor::Executor & executor, Node::SharedPtr & node_ptr,
Expand Down
2 changes: 1 addition & 1 deletion rclcpp/include/rclcpp/rclcpp.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -76,7 +76,7 @@ void spin(Node::SharedPtr & node_ptr)
executor.spin();
}

template <typename FutureT>
template<typename FutureT>
std::shared_future<FutureT> &
spin_until_future_complete(
Node::SharedPtr & node_ptr, std::shared_future<FutureT> & future)
Expand Down

0 comments on commit 4fa5422

Please sign in to comment.