Skip to content

Commit

Permalink
refactor(planning_debug_tools): rename wlid with with_lane_id (#2121)
Browse files Browse the repository at this point in the history
refactor(planning_debug_tools): rename wlid with with_lane_id

Signed-off-by: Kenji Miyake <kenji.miyake@tier4.jp>

Signed-off-by: Kenji Miyake <kenji.miyake@tier4.jp>
  • Loading branch information
kenji-miyake authored Oct 20, 2022
1 parent 3fc4b5c commit 15d0e83
Show file tree
Hide file tree
Showing 4 changed files with 10 additions and 8 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -116,7 +116,7 @@ class TrajectoryAnalyzerNode : public rclcpp::Node
void onEgoKinematics(const Odometry::ConstSharedPtr msg);

std::vector<std::shared_ptr<TrajectoryAnalyzer<Path>>> path_analyzers_;
std::vector<std::shared_ptr<TrajectoryAnalyzer<PathWithLaneId>>> path_wlid_analyzers_;
std::vector<std::shared_ptr<TrajectoryAnalyzer<PathWithLaneId>>> path_with_lane_id_analyzers_;
std::vector<std::shared_ptr<TrajectoryAnalyzer<Trajectory>>> trajectory_analyzers_;
};

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<node pkg="planning_debug_tools" exec="trajectory_analyzer_exe" name="trajectory_analyzer" output="screen">
<param name="path_topics" value="[/planning/scenario_planning/lane_driving/behavior_planning/path]"/>
<param
name="path_wlid_topics"
name="path_with_lane_id_topics"
value="[/planning/scenario_planning/lane_driving/behavior_planning/path_with_lane_id
,/planning/scenario_planning/lane_driving/behavior_planning/behavior_velocity_planner/debug/path_with_lane_id/crosswalk
,/planning/scenario_planning/lane_driving/behavior_planning/behavior_velocity_planner/debug/path_with_lane_id/intersection
Expand Down
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<launch>
<node pkg="planning_debug_tools" exec="trajectory_analyzer_exe" name="trajectory_analyzer" output="screen">
<param name="path_topics" value="[/planning/scenario_planning/lane_driving/behavior_planning/path]"/>
<param name="path_wlid_topics" value="[/planning/scenario_planning/lane_driving/behavior_planning/path_with_lane_id]"/>
<param name="path_with_lane_id_topics" value="[/planning/scenario_planning/lane_driving/behavior_planning/path_with_lane_id]"/>
<param
name="trajectory_topics"
value="[/planning/scenario_planning/lane_driving/motion_planning/obstacle_avoidance_planner/trajectory,
Expand Down
12 changes: 7 additions & 5 deletions planning/planning_debug_tools/src/trajectory_analyzer.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -21,16 +21,18 @@ TrajectoryAnalyzerNode::TrajectoryAnalyzerNode(const rclcpp::NodeOptions & optio
{
using TopicNames = std::vector<std::string>;
const auto path_topics = declare_parameter<TopicNames>("path_topics", TopicNames{});
const auto path_wlid_topics = declare_parameter<TopicNames>("path_wlid_topics", TopicNames{});
const auto path_with_lane_id_topics =
declare_parameter<TopicNames>("path_with_lane_id_topics", TopicNames{});
const auto trajectory_topics = declare_parameter<TopicNames>("trajectory_topics", TopicNames{});

for (const auto & s : path_topics) {
path_analyzers_.push_back(std::make_shared<TrajectoryAnalyzer<Path>>(this, s));
RCLCPP_INFO(get_logger(), "path_topics: %s", s.c_str());
}
for (const auto & s : path_wlid_topics) {
path_wlid_analyzers_.push_back(std::make_shared<TrajectoryAnalyzer<PathWithLaneId>>(this, s));
RCLCPP_INFO(get_logger(), "path_wlid_topics: %s", s.c_str());
for (const auto & s : path_with_lane_id_topics) {
path_with_lane_id_analyzers_.push_back(
std::make_shared<TrajectoryAnalyzer<PathWithLaneId>>(this, s));
RCLCPP_INFO(get_logger(), "path_with_lane_id_topics: %s", s.c_str());
}

for (const auto & s : trajectory_topics) {
Expand All @@ -48,7 +50,7 @@ void TrajectoryAnalyzerNode::onEgoKinematics(const Odometry::ConstSharedPtr msg)
for (auto & a : path_analyzers_) {
a->setKinematics(msg);
}
for (auto & a : path_wlid_analyzers_) {
for (auto & a : path_with_lane_id_analyzers_) {
a->setKinematics(msg);
}
for (auto & a : trajectory_analyzers_) {
Expand Down

0 comments on commit 15d0e83

Please sign in to comment.