Skip to content

Commit

Permalink
refactor(behavior_velocity_planner_common): remove unnecessary using
Browse files Browse the repository at this point in the history
Signed-off-by: Fumiya Watanabe <[email protected]>
  • Loading branch information
rej55 committed Jun 7, 2024
1 parent 40c7264 commit 97c8ec8
Show file tree
Hide file tree
Showing 15 changed files with 0 additions and 39 deletions.
1 change: 0 additions & 1 deletion planning/autoware_behavior_velocity_planner/src/node.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -46,7 +46,6 @@

namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::TrafficSignalStamped;
using autoware_behavior_velocity_planner::srv::LoadPlugin;
using autoware_behavior_velocity_planner::srv::UnloadPlugin;
using autoware_map_msgs::msg::LaneletMapBin;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -38,8 +38,6 @@

namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::PlannerData;
using autoware::behavior_velocity_planner::PluginInterface;

class BehaviorVelocityPlannerManager
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -26,7 +26,6 @@
#include <vector>
namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::Polygon2d;
using sensor_msgs::msg::PointCloud2;
using tier4_debug_msgs::msg::Float32MultiArrayStamped;
using tier4_debug_msgs::msg::Int32Stamped;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -32,8 +32,6 @@

namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::Point2d;
using autoware::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 @@ -44,7 +44,6 @@

namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::PlannerData;
using autoware_perception_msgs::msg::ObjectClassification;
using autoware_perception_msgs::msg::PredictedObjects;
using autoware_perception_msgs::msg::Shape;
Expand All @@ -56,7 +55,6 @@ using run_out_utils::PredictedPath;
using tier4_planning_msgs::msg::PathPointWithLaneId;
using tier4_planning_msgs::msg::PathWithLaneId;
using PathPointsWithLaneId = std::vector<tier4_planning_msgs::msg::PathPointWithLaneId>;
using autoware::behavior_velocity_planner::Polygons2d;

/**
* @brief base class for creating dynamic obstacles from multiple types of input
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -22,7 +22,6 @@

namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::SceneModuleManagerInterface;
using tier4_autoware_utils::getOrDeclareParameter;
RunOutModuleManager::RunOutModuleManager(rclcpp::Node & node)
: SceneModuleManagerInterface(node, getModuleName())
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -25,9 +25,6 @@

namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::PluginWrapper;
using autoware::behavior_velocity_planner::SceneModuleInterface;
using autoware::behavior_velocity_planner::SceneModuleManagerInterface;
class RunOutModuleManager : public SceneModuleManagerInterface
{
public:
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -37,11 +37,8 @@
namespace autoware::behavior_velocity_planner
{
namespace bg = boost::geometry;
using autoware::behavior_velocity_planner::PlanningBehavior;
using object_recognition_utils::convertLabelToString;
namespace planning_utils = autoware::behavior_velocity_planner::planning_utils;
using autoware::behavior_velocity_planner::getCrosswalksOnPath;
using autoware::behavior_velocity_planner::Polygon2d;

RunOutModule::RunOutModule(
const int64_t module_id, const std::shared_ptr<const PlannerData> & planner_data,
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -39,11 +39,6 @@ using tier4_debug_msgs::msg::Float32Stamped;
using tier4_planning_msgs::msg::PathPointWithLaneId;
using tier4_planning_msgs::msg::PathWithLaneId;
using BasicPolygons2d = std::vector<lanelet::BasicPolygon2d>;
using autoware::behavior_velocity_planner::PathWithLaneId;
using autoware::behavior_velocity_planner::PlannerData;
using autoware::behavior_velocity_planner::Polygon2d;
using autoware::behavior_velocity_planner::SceneModuleInterface;
using autoware::behavior_velocity_planner::StopReason;

class RunOutModule : public SceneModuleInterface
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -35,9 +35,6 @@
#include <tier4_autoware_utils/geometry/geometry.hpp>
namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::DetectionRange;
using autoware::behavior_velocity_planner::PathPointWithLaneId;
namespace planning_utils = autoware::behavior_velocity_planner::planning_utils;
namespace run_out_utils
{
Polygon2d createBoostPolyFromMsg(const std::vector<geometry_msgs::msg::Point> & input_poly)
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -34,8 +34,6 @@ namespace autoware::behavior_velocity_planner
namespace run_out_utils
{
namespace bg = boost::geometry;
using autoware::behavior_velocity_planner::PlannerData;
using autoware::behavior_velocity_planner::Polygons2d;
using autoware_perception_msgs::msg::ObjectClassification;
using autoware_perception_msgs::msg::PredictedObjects;
using autoware_perception_msgs::msg::Shape;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -23,8 +23,6 @@

namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::SceneModuleInterface;
using autoware::behavior_velocity_planner::StopReason;
using tier4_planning_msgs::msg::PathWithLaneId;

class TemplateModule : public SceneModuleInterface
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -29,9 +29,6 @@

namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::PluginWrapper;
using autoware::behavior_velocity_planner::SceneModuleInterface;
using autoware::behavior_velocity_planner::SceneModuleManagerInterface;
class VirtualTrafficLightModuleManager : public SceneModuleManagerInterface
{
public:
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -25,11 +25,6 @@

namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::PlanningBehavior;
using autoware::behavior_velocity_planner::SceneModuleInterface;
using autoware::behavior_velocity_planner::VelocityFactor;
namespace arc_lane_utils = autoware::behavior_velocity_planner::arc_lane_utils;
namespace planning_utils = autoware::behavior_velocity_planner::planning_utils;
namespace
{
using tier4_autoware_utils::calcDistance2d;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -32,10 +32,6 @@

namespace autoware::behavior_velocity_planner
{
using autoware::behavior_velocity_planner::PathWithLaneId;
using autoware::behavior_velocity_planner::Pose;
using autoware::behavior_velocity_planner::SceneModuleInterface;
using autoware::behavior_velocity_planner::StopReason;
class VirtualTrafficLightModule : public SceneModuleInterface
{
public:
Expand Down

0 comments on commit 97c8ec8

Please sign in to comment.