File tree 2 files changed +4
-3
lines changed
control/autoware_trajectory_follower_node
include/autoware_trajectory_follower_node
2 files changed +4
-3
lines changed Original file line number Diff line number Diff line change 15
15
#ifndef AUTOWARE_TRAJECTORY_FOLLOWER_NODE__CONTROLLER_NODE_HPP_
16
16
#define AUTOWARE_TRAJECTORY_FOLLOWER_NODE__CONTROLLER_NODE_HPP_
17
17
18
+ #include " autoware_trajectory_follower_node/visibility_control.hpp"
18
19
#include " rclcpp/rclcpp.hpp"
19
20
#include " tf2/utils.h"
20
21
#include " tf2_ros/buffer.h"
23
24
#include " tier4_autoware_utils/system/stop_watch.hpp"
24
25
#include " trajectory_follower_base/lateral_controller_base.hpp"
25
26
#include " trajectory_follower_base/longitudinal_controller_base.hpp"
26
- #include " autoware_trajectory_follower_node/visibility_control.hpp"
27
27
#include " vehicle_info_util/vehicle_info_util.hpp"
28
28
29
29
#include < Eigen/Core>
Original file line number Diff line number Diff line change 13
13
// limitations under the License.
14
14
15
15
#include " ament_index_cpp/get_package_share_directory.hpp"
16
+ #include " autoware_trajectory_follower_node/controller_node.hpp"
16
17
#include " fake_test_node/fake_test_node.hpp"
17
18
#include " gtest/gtest.h"
18
19
#include " rclcpp/rclcpp.hpp"
19
20
#include " rclcpp/time.hpp"
20
- #include " autoware_trajectory_follower_node/controller_node.hpp"
21
21
#include " trajectory_follower_test_utils.hpp"
22
22
23
23
#include " autoware_adapi_v1_msgs/msg/operation_mode_state.hpp"
@@ -49,7 +49,8 @@ const rclcpp::Duration one_second(1, 0);
49
49
rclcpp::NodeOptions makeNodeOptions (const bool enable_keep_stopped_until_steer_convergence = false )
50
50
{
51
51
// 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" );
53
54
const auto longitudinal_share_dir =
54
55
ament_index_cpp::get_package_share_directory (" pid_longitudinal_controller" );
55
56
const auto lateral_share_dir =
You can’t perform that action at this time.
0 commit comments