Skip to content

Commit

Permalink
style(pre-commit): autofix
Browse files Browse the repository at this point in the history
  • Loading branch information
pre-commit-ci[bot] committed May 28, 2024
1 parent 0db4780 commit 6b6fe98
Show file tree
Hide file tree
Showing 9 changed files with 14 additions and 13 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -26,10 +26,10 @@
#include <vector>
namespace autoware::behavior_velocity_planner
{
using ::behavior_velocity_planner::Polygon2d;
using sensor_msgs::msg::PointCloud2;
using tier4_debug_msgs::msg::Float32MultiArrayStamped;
using tier4_debug_msgs::msg::Int32Stamped;
using ::behavior_velocity_planner::Polygon2d;

class DebugValues
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -32,8 +32,8 @@

namespace autoware::behavior_velocity_planner
{
using ::behavior_velocity_planner::splineInterpolate;
using ::behavior_velocity_planner::Point2d;
using ::behavior_velocity_planner::splineInterpolate;
namespace
{
// create quaternion facing to the nearest trajectory point
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -49,12 +49,12 @@ using autoware_auto_perception_msgs::msg::PredictedObjects;
using autoware_auto_perception_msgs::msg::Shape;
using autoware_auto_planning_msgs::msg::PathPointWithLaneId;
using autoware_auto_planning_msgs::msg::PathWithLaneId;
using ::behavior_velocity_planner::PlannerData;
using run_out_utils::DynamicObstacle;
using run_out_utils::DynamicObstacleData;
using run_out_utils::DynamicObstacleParam;
using run_out_utils::PlannerParam;
using run_out_utils::PredictedPath;
using ::behavior_velocity_planner::PlannerData;
using PathPointsWithLaneId = std::vector<autoware_auto_planning_msgs::msg::PathPointWithLaneId>;
using ::behavior_velocity_planner::Polygons2d;

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -22,8 +22,8 @@

namespace autoware::behavior_velocity_planner
{
using tier4_autoware_utils::getOrDeclareParameter;
using ::behavior_velocity_planner::SceneModuleManagerInterface;
using tier4_autoware_utils::getOrDeclareParameter;
RunOutModuleManager::RunOutModuleManager(rclcpp::Node & node)
: SceneModuleManagerInterface(node, getModuleName())
{
Expand Down Expand Up @@ -204,4 +204,5 @@ void RunOutModuleManager::setDynamicObstacleCreator(

#include <pluginlib/class_list_macros.hpp>
PLUGINLIB_EXPORT_CLASS(
autoware::behavior_velocity_planner::RunOutModulePlugin, behavior_velocity_planner::PluginInterface)
autoware::behavior_velocity_planner::RunOutModulePlugin,
behavior_velocity_planner::PluginInterface)
Original file line number Diff line number Diff line change
Expand Up @@ -25,9 +25,9 @@

namespace autoware::behavior_velocity_planner
{
using ::behavior_velocity_planner::PluginWrapper;
using ::behavior_velocity_planner::SceneModuleInterface;
using ::behavior_velocity_planner::SceneModuleManagerInterface;
using ::behavior_velocity_planner::PluginWrapper;
class RunOutModuleManager : public SceneModuleManagerInterface
{
public:
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -37,8 +37,8 @@
namespace autoware::behavior_velocity_planner
{
namespace bg = boost::geometry;
using object_recognition_utils::convertLabelToString;
using ::behavior_velocity_planner::PlanningBehavior;
using object_recognition_utils::convertLabelToString;
namespace planning_utils = ::behavior_velocity_planner::planning_utils;
using ::behavior_velocity_planner::getCrosswalksOnPath;
using ::behavior_velocity_planner::Polygon2d;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -39,11 +39,11 @@ using run_out_utils::PlannerParam;
using run_out_utils::PoseWithRange;
using tier4_debug_msgs::msg::Float32Stamped;
using BasicPolygons2d = std::vector<lanelet::BasicPolygon2d>;
using ::behavior_velocity_planner::SceneModuleInterface;
using ::behavior_velocity_planner::PlannerData;
using ::behavior_velocity_planner::StopReason;
using ::behavior_velocity_planner::PathWithLaneId;
using ::behavior_velocity_planner::PlannerData;
using ::behavior_velocity_planner::Polygon2d;
using ::behavior_velocity_planner::SceneModuleInterface;
using ::behavior_velocity_planner::StopReason;

class RunOutModule : public SceneModuleInterface
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -35,8 +35,8 @@
#include <tier4_autoware_utils/geometry/geometry.hpp>
namespace autoware::behavior_velocity_planner
{
using ::behavior_velocity_planner::PathPointWithLaneId;
using ::behavior_velocity_planner::DetectionRange;
using ::behavior_velocity_planner::PathPointWithLaneId;
namespace planning_utils = ::behavior_velocity_planner::planning_utils;
namespace run_out_utils
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -39,14 +39,14 @@ using autoware_auto_perception_msgs::msg::PredictedObjects;
using autoware_auto_perception_msgs::msg::Shape;
using autoware_auto_planning_msgs::msg::PathPoint;
using autoware_auto_planning_msgs::msg::PathWithLaneId;
using ::behavior_velocity_planner::PlannerData;
using ::behavior_velocity_planner::Polygons2d;
using tier4_autoware_utils::Box2d;
using tier4_autoware_utils::LineString2d;
using tier4_autoware_utils::Point2d;
using tier4_autoware_utils::Polygon2d;
using tier4_debug_msgs::msg::Float32Stamped;
using vehicle_info_util::VehicleInfo;
using ::behavior_velocity_planner::Polygons2d;
using ::behavior_velocity_planner::PlannerData;
using PathPointsWithLaneId = std::vector<autoware_auto_planning_msgs::msg::PathPointWithLaneId>;
struct CommonParam
{
Expand Down

0 comments on commit 6b6fe98

Please sign in to comment.