Skip to content

Commit

Permalink
fix(obstacle_stop_planner): modify build error in rolling
Browse files Browse the repository at this point in the history
Signed-off-by: wep21 <border_goldenmarket@yahoo.co.jp>
  • Loading branch information
wep21 committed Apr 24, 2022
1 parent e35e31c commit 1e14958
Show file tree
Hide file tree
Showing 3 changed files with 10 additions and 1 deletion.
Original file line number Diff line number Diff line change
Expand Up @@ -665,7 +665,7 @@ double AdaptiveCruiseController::getMedianVel(const std::vector<nav_msgs::msg::O
}

std::vector<double> raw_vel_que;
for (const auto vel : vel_que) {
for (const auto & vel : vel_que) {
raw_vel_que.emplace_back(vel.twist.twist.linear.x);
}

Expand Down
4 changes: 4 additions & 0 deletions planning/obstacle_stop_planner/src/debug_marker.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -16,7 +16,11 @@

#include <tier4_autoware_utils/tier4_autoware_utils.hpp>

#ifdef USE_TF2_GEOMETRY_MSGS_DEPRECATED_HEADER
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#else
#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
#endif

#include <memory>
#include <vector>
Expand Down
5 changes: 5 additions & 0 deletions planning/obstacle_stop_planner/src/node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -30,7 +30,12 @@

#include <pcl/filters/voxel_grid.h>
#include <tf2/utils.h>

#ifdef USE_TF2_GEOMETRY_MSGS_DEPRECATED_HEADER
#include <tf2_eigen/tf2_eigen.h>
#else
#include <tf2_eigen/tf2_eigen.hpp>
#endif

namespace motion_planning
{
Expand Down

0 comments on commit 1e14958

Please sign in to comment.