Skip to content

Commit 2edd55e

Browse files
refactor(motion_utils): change directory name of tmp_conversion (autowarefoundation#5908)
* change .hpp name Signed-off-by: Zhe Shen <lucidshenzhe@gmail.com> * change .cpp name Signed-off-by: Zhe Shen <lucidshenzhe@gmail.com> * correct the #inlcude and #ifndef Signed-off-by: Zhe Shen <lucidshenzhe@gmail.com> * change the CMakeLists.txt Signed-off-by: Zhe Shen <lucidshenzhe@gmail.com> * correct the dependencies referring to tmp_conversion Signed-off-by: Zhe Shen <lucidshenzhe@gmail.com> * style(pre-commit): autofix * change all the tmp_conversion to conversion in all the autoware.universe Signed-off-by: Zhe Shen <lucidshenzhe@gmail.com> * style(pre-commit): autofix --------- Signed-off-by: Zhe Shen <lucidshenzhe@gmail.com> Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com>
1 parent 64c6dba commit 2edd55e

File tree

24 files changed

+26
-26
lines changed

24 files changed

+26
-26
lines changed

common/motion_utils/CMakeLists.txt

+1-1
Original file line numberDiff line numberDiff line change
@@ -14,7 +14,7 @@ ament_auto_add_library(motion_utils SHARED
1414
src/trajectory/trajectory.cpp
1515
src/trajectory/interpolation.cpp
1616
src/trajectory/path_with_lane_id.cpp
17-
src/trajectory/tmp_conversion.cpp
17+
src/trajectory/conversion.cpp
1818
src/vehicle/vehicle_state_checker.cpp
1919
)
2020

common/motion_utils/include/motion_utils/trajectory/tmp_conversion.hpp common/motion_utils/include/motion_utils/trajectory/conversion.hpp

+3-3
Original file line numberDiff line numberDiff line change
@@ -12,8 +12,8 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15-
#ifndef MOTION_UTILS__TRAJECTORY__TMP_CONVERSION_HPP_
16-
#define MOTION_UTILS__TRAJECTORY__TMP_CONVERSION_HPP_
15+
#ifndef MOTION_UTILS__TRAJECTORY__CONVERSION_HPP_
16+
#define MOTION_UTILS__TRAJECTORY__CONVERSION_HPP_
1717

1818
#include "autoware_auto_planning_msgs/msg/detail/trajectory__struct.hpp"
1919
#include "autoware_auto_planning_msgs/msg/detail/trajectory_point__struct.hpp"
@@ -45,4 +45,4 @@ std::vector<autoware_auto_planning_msgs::msg::TrajectoryPoint> convertToTrajecto
4545

4646
} // namespace motion_utils
4747

48-
#endif // MOTION_UTILS__TRAJECTORY__TMP_CONVERSION_HPP_
48+
#endif // MOTION_UTILS__TRAJECTORY__CONVERSION_HPP_

common/motion_utils/src/trajectory/tmp_conversion.cpp common/motion_utils/src/trajectory/conversion.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -12,7 +12,7 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15-
#include "motion_utils/trajectory/tmp_conversion.hpp"
15+
#include "motion_utils/trajectory/conversion.hpp"
1616

1717
#include <algorithm>
1818

common/motion_utils/test/src/trajectory/test_interpolation.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -12,8 +12,8 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15+
#include "motion_utils/trajectory/conversion.hpp"
1516
#include "motion_utils/trajectory/interpolation.hpp"
16-
#include "motion_utils/trajectory/tmp_conversion.hpp"
1717
#include "motion_utils/trajectory/trajectory.hpp"
1818
#include "tier4_autoware_utils/geometry/boost_geometry.hpp"
1919
#include "tier4_autoware_utils/math/unit_conversion.hpp"

common/motion_utils/test/src/trajectory/test_trajectory.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -12,7 +12,7 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15-
#include "motion_utils/trajectory/tmp_conversion.hpp"
15+
#include "motion_utils/trajectory/conversion.hpp"
1616
#include "motion_utils/trajectory/trajectory.hpp"
1717
#include "tier4_autoware_utils/geometry/boost_geometry.hpp"
1818
#include "tier4_autoware_utils/math/unit_conversion.hpp"

control/control_validator/include/control_validator/utils.hpp

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

18-
#include <motion_utils/trajectory/tmp_conversion.hpp>
18+
#include <motion_utils/trajectory/conversion.hpp>
1919
#include <rclcpp/rclcpp.hpp>
2020

2121
#include <autoware_auto_planning_msgs/msg/trajectory.hpp>

control/predicted_path_checker/include/predicted_path_checker/collision_checker.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,8 +15,8 @@
1515
#ifndef PREDICTED_PATH_CHECKER__COLLISION_CHECKER_HPP_
1616
#define PREDICTED_PATH_CHECKER__COLLISION_CHECKER_HPP_
1717

18+
#include <motion_utils/trajectory/conversion.hpp>
1819
#include <motion_utils/trajectory/interpolation.hpp>
19-
#include <motion_utils/trajectory/tmp_conversion.hpp>
2020
#include <predicted_path_checker/debug_marker.hpp>
2121
#include <predicted_path_checker/utils.hpp>
2222
#include <rclcpp/rclcpp.hpp>

control/predicted_path_checker/include/predicted_path_checker/predicted_path_checker_node.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -18,7 +18,7 @@
1818
#include <component_interface_specs/control.hpp>
1919
#include <component_interface_utils/rclcpp.hpp>
2020
#include <diagnostic_updater/diagnostic_updater.hpp>
21-
#include <motion_utils/trajectory/tmp_conversion.hpp>
21+
#include <motion_utils/trajectory/conversion.hpp>
2222
#include <motion_utils/trajectory/trajectory.hpp>
2323
#include <predicted_path_checker/collision_checker.hpp>
2424
#include <predicted_path_checker/utils.hpp>

control/pure_pursuit/include/pure_pursuit/pure_pursuit_lateral_controller.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -38,7 +38,7 @@
3838
#include "trajectory_follower_base/lateral_controller_base.hpp"
3939

4040
#include <motion_utils/resample/resample.hpp>
41-
#include <motion_utils/trajectory/tmp_conversion.hpp>
41+
#include <motion_utils/trajectory/conversion.hpp>
4242
#include <motion_utils/trajectory/trajectory.hpp>
4343

4444
#include "autoware_auto_control_msgs/msg/ackermann_lateral_command.hpp"

planning/motion_velocity_smoother/include/motion_velocity_smoother/motion_velocity_smoother_node.hpp

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

18-
#include "motion_utils/trajectory/tmp_conversion.hpp"
18+
#include "motion_utils/trajectory/conversion.hpp"
1919
#include "motion_utils/trajectory/trajectory.hpp"
2020
#include "motion_velocity_smoother/resample.hpp"
2121
#include "motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.hpp"

planning/motion_velocity_smoother/src/resample.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "motion_velocity_smoother/resample.hpp"
1616

1717
#include "motion_utils/resample/resample.hpp"
18-
#include "motion_utils/trajectory/tmp_conversion.hpp"
18+
#include "motion_utils/trajectory/conversion.hpp"
1919
#include "motion_utils/trajectory/trajectory.hpp"
2020
#include "motion_velocity_smoother/trajectory_utils.hpp"
2121

planning/motion_velocity_smoother/src/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.hpp"
1616

1717
#include "motion_utils/resample/resample.hpp"
18-
#include "motion_utils/trajectory/tmp_conversion.hpp"
18+
#include "motion_utils/trajectory/conversion.hpp"
1919
#include "motion_velocity_smoother/trajectory_utils.hpp"
2020

2121
#include <algorithm>

planning/motion_velocity_smoother/src/smoother/smoother_base.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "motion_velocity_smoother/smoother/smoother_base.hpp"
1616

1717
#include "motion_utils/resample/resample.hpp"
18-
#include "motion_utils/trajectory/tmp_conversion.hpp"
18+
#include "motion_utils/trajectory/conversion.hpp"
1919
#include "motion_utils/trajectory/trajectory.hpp"
2020
#include "motion_velocity_smoother/resample.hpp"
2121
#include "motion_velocity_smoother/trajectory_utils.hpp"

planning/obstacle_avoidance_planner/src/utils/trajectory_utils.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "obstacle_avoidance_planner/utils/trajectory_utils.hpp"
1616

1717
#include "motion_utils/resample/resample.hpp"
18-
#include "motion_utils/trajectory/tmp_conversion.hpp"
18+
#include "motion_utils/trajectory/conversion.hpp"
1919
#include "motion_utils/trajectory/trajectory.hpp"
2020
#include "obstacle_avoidance_planner/mpt_optimizer.hpp"
2121
#include "obstacle_avoidance_planner/utils/geometry_utils.hpp"

planning/obstacle_cruise_planner/include/obstacle_cruise_planner/common_structs.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,8 +15,8 @@
1515
#ifndef OBSTACLE_CRUISE_PLANNER__COMMON_STRUCTS_HPP_
1616
#define OBSTACLE_CRUISE_PLANNER__COMMON_STRUCTS_HPP_
1717

18+
#include "motion_utils/trajectory/conversion.hpp"
1819
#include "motion_utils/trajectory/interpolation.hpp"
19-
#include "motion_utils/trajectory/tmp_conversion.hpp"
2020
#include "motion_utils/trajectory/trajectory.hpp"
2121
#include "obstacle_cruise_planner/type_alias.hpp"
2222
#include "tier4_autoware_utils/geometry/boost_polygon_utils.hpp"

planning/obstacle_cruise_planner/src/node.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "obstacle_cruise_planner/node.hpp"
1616

1717
#include "motion_utils/resample/resample.hpp"
18-
#include "motion_utils/trajectory/tmp_conversion.hpp"
18+
#include "motion_utils/trajectory/conversion.hpp"
1919
#include "object_recognition_utils/predicted_path_utils.hpp"
2020
#include "obstacle_cruise_planner/polygon_utils.hpp"
2121
#include "obstacle_cruise_planner/utils.hpp"

planning/obstacle_cruise_planner/src/planner_interface.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -17,7 +17,7 @@
1717
#include "motion_utils/distance/distance.hpp"
1818
#include "motion_utils/marker/marker_helper.hpp"
1919
#include "motion_utils/resample/resample.hpp"
20-
#include "motion_utils/trajectory/tmp_conversion.hpp"
20+
#include "motion_utils/trajectory/conversion.hpp"
2121
#include "motion_utils/trajectory/trajectory.hpp"
2222
#include "signal_processing/lowpass_filter_1d.hpp"
2323
#include "tier4_autoware_utils/ros/marker_helper.hpp"

planning/obstacle_stop_planner/include/obstacle_stop_planner/node.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -21,7 +21,7 @@
2121
#include "tier4_autoware_utils/ros/logger_level_configure.hpp"
2222
#include "tier4_autoware_utils/system/stop_watch.hpp"
2323

24-
#include <motion_utils/trajectory/tmp_conversion.hpp>
24+
#include <motion_utils/trajectory/conversion.hpp>
2525
#include <motion_utils/trajectory/trajectory.hpp>
2626
#include <pcl_ros/transforms.hpp>
2727
#include <rclcpp/rclcpp.hpp>

planning/obstacle_stop_planner/src/planner_utils.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "obstacle_stop_planner/planner_utils.hpp"
1616

1717
#include <motion_utils/distance/distance.hpp>
18-
#include <motion_utils/trajectory/tmp_conversion.hpp>
18+
#include <motion_utils/trajectory/conversion.hpp>
1919
#include <motion_utils/trajectory/trajectory.hpp>
2020
#include <tier4_autoware_utils/geometry/boost_polygon_utils.hpp>
2121

planning/path_smoother/src/utils/trajectory_utils.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "path_smoother/utils/trajectory_utils.hpp"
1616

1717
#include "motion_utils/resample/resample.hpp"
18-
#include "motion_utils/trajectory/tmp_conversion.hpp"
18+
#include "motion_utils/trajectory/conversion.hpp"
1919
#include "path_smoother/utils/geometry_utils.hpp"
2020

2121
#include "autoware_auto_planning_msgs/msg/path_point.hpp"

planning/planning_topic_converter/src/path_to_trajectory.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -14,7 +14,7 @@
1414

1515
#include "planning_topic_converter/path_to_trajectory.hpp"
1616

17-
#include <motion_utils/trajectory/tmp_conversion.hpp>
17+
#include <motion_utils/trajectory/conversion.hpp>
1818
#include <tier4_autoware_utils/geometry/geometry.hpp>
1919

2020
namespace planning_topic_converter

planning/sampling_based_planner/path_sampler/src/utils/trajectory_utils.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "path_sampler/utils/trajectory_utils.hpp"
1616

1717
#include "motion_utils/resample/resample.hpp"
18-
#include "motion_utils/trajectory/tmp_conversion.hpp"
18+
#include "motion_utils/trajectory/conversion.hpp"
1919
#include "path_sampler/utils/geometry_utils.hpp"
2020
#include "tf2/utils.h"
2121

planning/static_centerline_optimizer/src/static_centerline_optimizer_node.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -18,7 +18,7 @@
1818
#include "lanelet2_extension/utility/query.hpp"
1919
#include "lanelet2_extension/utility/utilities.hpp"
2020
#include "map_loader/lanelet2_map_loader_node.hpp"
21-
#include "motion_utils/trajectory/tmp_conversion.hpp"
21+
#include "motion_utils/trajectory/conversion.hpp"
2222
#include "static_centerline_optimizer/msg/points_with_lane_id.hpp"
2323
#include "static_centerline_optimizer/successive_trajectory_optimizer_node.hpp"
2424
#include "static_centerline_optimizer/type_alias.hpp"

planning/static_centerline_optimizer/src/successive_trajectory_optimizer_node.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "static_centerline_optimizer/successive_trajectory_optimizer_node.hpp"
1616

1717
#include "motion_utils/resample/resample.hpp"
18-
#include "motion_utils/trajectory/tmp_conversion.hpp"
18+
#include "motion_utils/trajectory/conversion.hpp"
1919
#include "motion_utils/trajectory/trajectory.hpp"
2020
#include "obstacle_avoidance_planner/utils/trajectory_utils.hpp"
2121
#include "tier4_autoware_utils/geometry/geometry.hpp"

0 commit comments

Comments
 (0)