Skip to content

Commit

Permalink
Fix linter, attempt 2
Browse files Browse the repository at this point in the history
Signed-off-by: Jorge Perez <[email protected]>
  • Loading branch information
Blast545 committed Jan 14, 2022
1 parent e468ae6 commit 3538f0f
Showing 1 changed file with 3 additions and 3 deletions.
6 changes: 3 additions & 3 deletions include/ros1_bridge/builtin_interfaces_factories.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -15,13 +15,13 @@
#ifndef ROS1_BRIDGE__BUILTIN_INTERFACES_FACTORIES_HPP_
#define ROS1_BRIDGE__BUILTIN_INTERFACES_FACTORIES_HPP_

#include <memory>
#include <string>

// include ROS 1 messages
#include <std_msgs/Duration.h>
#include <std_msgs/Time.h>

#include <memory>
#include <string>

// include ROS 2 messages
#include <builtin_interfaces/msg/duration.hpp>
#include <builtin_interfaces/msg/time.hpp>
Expand Down

0 comments on commit 3538f0f

Please sign in to comment.