Skip to content

Commit

Permalink
Merge pull request #198 from youtalk/include-chrono-if-using-chrono-l…
Browse files Browse the repository at this point in the history
…iterals

Add #include <chrono> if using std::chrono_literals
  • Loading branch information
mikaelarguedas committed Dec 22, 2017
2 parents 5c635c9 + 4770378 commit a75151e
Show file tree
Hide file tree
Showing 5 changed files with 5 additions and 0 deletions.
1 change: 1 addition & 0 deletions rclcpp/minimal_publisher/lambda.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -12,6 +12,7 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#include <chrono>
#include "rclcpp/rclcpp.hpp"
#include "std_msgs/msg/string.hpp"

Expand Down
1 change: 1 addition & 0 deletions rclcpp/minimal_publisher/member_function.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -12,6 +12,7 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#include <chrono>
#include "rclcpp/rclcpp.hpp"
#include "std_msgs/msg/string.hpp"

Expand Down
1 change: 1 addition & 0 deletions rclcpp/minimal_publisher/not_composable.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -13,6 +13,7 @@
// limitations under the License.

#include <iostream>
#include <chrono>
#include "rclcpp/rclcpp.hpp"
#include "std_msgs/msg/string.hpp"

Expand Down
1 change: 1 addition & 0 deletions rclcpp/minimal_timer/lambda.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -12,6 +12,7 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#include <chrono>
#include "rclcpp/rclcpp.hpp"

using namespace std::chrono_literals;
Expand Down
1 change: 1 addition & 0 deletions rclcpp/minimal_timer/member_function.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -12,6 +12,7 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#include <chrono>
#include "rclcpp/rclcpp.hpp"

using namespace std::chrono_literals;
Expand Down

0 comments on commit a75151e

Please sign in to comment.