Skip to content

Commit e97c051

Browse files
style(pre-commit): autofix
1 parent cca98c3 commit e97c051

8 files changed

+25
-29
lines changed

planning/static_centerline_generator/src/centerline_source/bag_ego_trajectory_based_centerline.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -13,10 +13,10 @@
1313
// limitations under the License.
1414

1515
#include "centerline_source/bag_ego_trajectory_based_centerline.hpp"
16-
#include "static_centerline_generator_node.hpp"
1716

1817
#include "rclcpp/serialization.hpp"
1918
#include "rosbag2_cpp/reader.hpp"
19+
#include "static_centerline_generator_node.hpp"
2020

2121
#include <nav_msgs/msg/odometry.hpp>
2222

planning/static_centerline_generator/src/centerline_source/bag_ego_trajectory_based_centerline.hpp

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

15-
#ifndef STATIC_CENTERLINE_GENERATOR__CENTERLINE_SOURCE__BAG_EGO_TRAJECTORY_BASED_CENTERLINE_HPP_
16-
#define STATIC_CENTERLINE_GENERATOR__CENTERLINE_SOURCE__BAG_EGO_TRAJECTORY_BASED_CENTERLINE_HPP_
17-
18-
#include "type_alias.hpp"
15+
#ifndef CENTERLINE_SOURCE__BAG_EGO_TRAJECTORY_BASED_CENTERLINE_HPP_
16+
#define CENTERLINE_SOURCE__BAG_EGO_TRAJECTORY_BASED_CENTERLINE_HPP_
1917

2018
#include "rclcpp/rclcpp.hpp"
19+
#include "type_alias.hpp"
2120

2221
#include <vector>
2322

2423
namespace static_centerline_generator
2524
{
2625
std::vector<TrajectoryPoint> generate_centerline_with_bag(rclcpp::Node & node);
2726
} // namespace static_centerline_generator
28-
#endif // STATIC_CENTERLINE_GENERATOR__CENTERLINE_SOURCE__BAG_EGO_TRAJECTORY_BASED_CENTERLINE_HPP_
27+
#endif // CENTERLINE_SOURCE__BAG_EGO_TRAJECTORY_BASED_CENTERLINE_HPP_

planning/static_centerline_generator/src/centerline_source/optimization_trajectory_based_centerline.cpp

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

1515
#include "centerline_source/optimization_trajectory_based_centerline.hpp"
16-
#include "static_centerline_generator_node.hpp"
17-
#include "utils.hpp"
1816

1917
#include "motion_utils/resample/resample.hpp"
2018
#include "motion_utils/trajectory/conversion.hpp"
2119
#include "obstacle_avoidance_planner/node.hpp"
2220
#include "path_smoother/elastic_band_smoother.hpp"
21+
#include "static_centerline_generator_node.hpp"
2322
#include "tier4_autoware_utils/ros/parameter.hpp"
23+
#include "utils.hpp"
2424

2525
namespace static_centerline_generator
2626
{

planning/static_centerline_generator/src/centerline_source/optimization_trajectory_based_centerline.hpp

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

15-
#ifndef STATIC_CENTERLINE_GENERATOR__CENTERLINE_SOURCE__OPTIMIZATION_TRAJECTORY_BASED_CENTERLINE_HPP_ // NOLINT
16-
#define STATIC_CENTERLINE_GENERATOR__CENTERLINE_SOURCE__OPTIMIZATION_TRAJECTORY_BASED_CENTERLINE_HPP_ // NOLINT
17-
18-
#include "type_alias.hpp"
15+
#ifndef CENTERLINE_SOURCE__OPTIMIZATION_TRAJECTORY_BASED_CENTERLINE_HPP_ // NOLINT
16+
#define CENTERLINE_SOURCE__OPTIMIZATION_TRAJECTORY_BASED_CENTERLINE_HPP_ // NOLINT
1917

2018
#include "rclcpp/rclcpp.hpp"
19+
#include "type_alias.hpp"
2120

2221
#include <vector>
2322

@@ -40,5 +39,5 @@ class OptimizationTrajectoryBasedCenterline
4039
};
4140
} // namespace static_centerline_generator
4241
// clang-format off
43-
#endif // STATIC_CENTERLINE_GENERATOR__CENTERLINE_SOURCE__OPTIMIZATION_TRAJECTORY_BASED_CENTERLINE_HPP_ // NOLINT
42+
#endif // CENTERLINE_SOURCE__OPTIMIZATION_TRAJECTORY_BASED_CENTERLINE_HPP_ // NOLINT
4443
// clang-format on

planning/static_centerline_generator/src/static_centerline_generator_node.cpp

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

15-
#include "centerline_source/bag_ego_trajectory_based_centerline.hpp"
1615
#include "static_centerline_generator_node.hpp"
17-
#include "type_alias.hpp"
18-
#include "utils.hpp"
1916

17+
#include "centerline_source/bag_ego_trajectory_based_centerline.hpp"
2018
#include "lanelet2_extension/utility/message_conversion.hpp"
2119
#include "lanelet2_extension/utility/query.hpp"
2220
#include "lanelet2_extension/utility/utilities.hpp"
@@ -27,6 +25,8 @@
2725
#include "static_centerline_generator/msg/points_with_lane_id.hpp"
2826
#include "tier4_autoware_utils/geometry/geometry.hpp"
2927
#include "tier4_autoware_utils/ros/parameter.hpp"
28+
#include "type_alias.hpp"
29+
#include "utils.hpp"
3030

3131
#include <geography_utils/lanelet2_projector.hpp>
3232
#include <mission_planner/mission_planner_plugin.hpp>

planning/static_centerline_generator/src/static_centerline_generator_node.hpp

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

15-
#ifndef STATIC_CENTERLINE_GENERATOR__STATIC_CENTERLINE_GENERATOR_NODE_HPP_
16-
#define STATIC_CENTERLINE_GENERATOR__STATIC_CENTERLINE_GENERATOR_NODE_HPP_
15+
#ifndef STATIC_CENTERLINE_GENERATOR_NODE_HPP_
16+
#define STATIC_CENTERLINE_GENERATOR_NODE_HPP_
1717

1818
#include "centerline_source/optimization_trajectory_based_centerline.hpp"
19-
#include "type_alias.hpp"
20-
2119
#include "rclcpp/rclcpp.hpp"
2220
#include "static_centerline_generator/srv/load_map.hpp"
2321
#include "static_centerline_generator/srv/plan_path.hpp"
2422
#include "static_centerline_generator/srv/plan_route.hpp"
23+
#include "type_alias.hpp"
2524
#include "vehicle_info_util/vehicle_info_util.hpp"
2625

2726
#include <geography_utils/lanelet2_projector.hpp>
@@ -117,4 +116,4 @@ class StaticCenterlineGeneratorNode : public rclcpp::Node
117116
vehicle_info_util::VehicleInfo vehicle_info_;
118117
};
119118
} // namespace static_centerline_generator
120-
#endif // STATIC_CENTERLINE_GENERATOR__STATIC_CENTERLINE_GENERATOR_NODE_HPP_
119+
#endif // STATIC_CENTERLINE_GENERATOR_NODE_HPP_

planning/static_centerline_generator/src/type_alias.hpp

+3-3
Original file line numberDiff line numberDiff line change
@@ -11,8 +11,8 @@
1111
// WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
14-
#ifndef STATIC_CENTERLINE_GENERATOR__TYPE_ALIAS_HPP_
15-
#define STATIC_CENTERLINE_GENERATOR__TYPE_ALIAS_HPP_
14+
#ifndef TYPE_ALIAS_HPP_
15+
#define TYPE_ALIAS_HPP_
1616

1717
#include "route_handler/route_handler.hpp"
1818
#include "tier4_autoware_utils/geometry/geometry.hpp"
@@ -43,4 +43,4 @@ using tier4_autoware_utils::Point2d;
4343
using visualization_msgs::msg::MarkerArray;
4444
} // namespace static_centerline_generator
4545

46-
#endif // STATIC_CENTERLINE_GENERATOR__TYPE_ALIAS_HPP_
46+
#endif // TYPE_ALIAS_HPP_

planning/static_centerline_generator/src/utils.hpp

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

15-
#ifndef STATIC_CENTERLINE_GENERATOR__UTILS_HPP_
16-
#define STATIC_CENTERLINE_GENERATOR__UTILS_HPP_
17-
18-
#include "type_alias.hpp"
15+
#ifndef UTILS_HPP_
16+
#define UTILS_HPP_
1917

2018
#include "route_handler/route_handler.hpp"
19+
#include "type_alias.hpp"
2120

2221
#include <rclcpp/time.hpp>
2322

@@ -56,4 +55,4 @@ MarkerArray create_distance_text_marker(
5655
} // namespace utils
5756
} // namespace static_centerline_generator
5857

59-
#endif // STATIC_CENTERLINE_GENERATOR__UTILS_HPP_
58+
#endif // UTILS_HPP_

0 commit comments

Comments
 (0)