Skip to content

Commit 47deb7e

Browse files
committed
fix formats
Signed-off-by: mohammad alqudah <alqudah.mohammad@tier4.jp>
1 parent f07b162 commit 47deb7e

File tree

2 files changed

+4
-3
lines changed

2 files changed

+4
-3
lines changed

control/autoware_trajectory_follower_node/include/autoware_trajectory_follower_node/controller_node.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,6 +15,7 @@
1515
#ifndef AUTOWARE_TRAJECTORY_FOLLOWER_NODE__CONTROLLER_NODE_HPP_
1616
#define AUTOWARE_TRAJECTORY_FOLLOWER_NODE__CONTROLLER_NODE_HPP_
1717

18+
#include "autoware_trajectory_follower_node/visibility_control.hpp"
1819
#include "rclcpp/rclcpp.hpp"
1920
#include "tf2/utils.h"
2021
#include "tf2_ros/buffer.h"
@@ -23,7 +24,6 @@
2324
#include "tier4_autoware_utils/system/stop_watch.hpp"
2425
#include "trajectory_follower_base/lateral_controller_base.hpp"
2526
#include "trajectory_follower_base/longitudinal_controller_base.hpp"
26-
#include "autoware_trajectory_follower_node/visibility_control.hpp"
2727
#include "vehicle_info_util/vehicle_info_util.hpp"
2828

2929
#include <Eigen/Core>

control/autoware_trajectory_follower_node/test/test_controller_node.cpp

+3-2
Original file line numberDiff line numberDiff line change
@@ -13,11 +13,11 @@
1313
// limitations under the License.
1414

1515
#include "ament_index_cpp/get_package_share_directory.hpp"
16+
#include "autoware_trajectory_follower_node/controller_node.hpp"
1617
#include "fake_test_node/fake_test_node.hpp"
1718
#include "gtest/gtest.h"
1819
#include "rclcpp/rclcpp.hpp"
1920
#include "rclcpp/time.hpp"
20-
#include "autoware_trajectory_follower_node/controller_node.hpp"
2121
#include "trajectory_follower_test_utils.hpp"
2222

2323
#include "autoware_adapi_v1_msgs/msg/operation_mode_state.hpp"
@@ -49,7 +49,8 @@ const rclcpp::Duration one_second(1, 0);
4949
rclcpp::NodeOptions makeNodeOptions(const bool enable_keep_stopped_until_steer_convergence = false)
5050
{
5151
// Pass default parameter file to the node
52-
const auto share_dir = ament_index_cpp::get_package_share_directory("autoware_trajectory_follower_node");
52+
const auto share_dir =
53+
ament_index_cpp::get_package_share_directory("autoware_trajectory_follower_node");
5354
const auto longitudinal_share_dir =
5455
ament_index_cpp::get_package_share_directory("pid_longitudinal_controller");
5556
const auto lateral_share_dir =

0 commit comments

Comments
 (0)