Skip to content

Commit

Permalink
fix humble CI
Browse files Browse the repository at this point in the history
Signed-off-by: Takayuki Murooka <takayuki5168@gmail.com>
  • Loading branch information
takayuki5168 committed Jun 6, 2022
1 parent a93fe66 commit b9f8dde
Show file tree
Hide file tree
Showing 3 changed files with 8 additions and 3 deletions.
2 changes: 1 addition & 1 deletion planning/obstacle_cruise_planner/src/node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -200,7 +200,7 @@ ObstacleCruisePlannerNode::ObstacleCruisePlannerNode(const rclcpp::NodeOptions &
debug_cruise_wall_marker_pub_ =
create_publisher<visualization_msgs::msg::MarkerArray>("~/debug/cruise_wall_marker", 1);
debug_stop_wall_marker_pub_ =
create_publisher<visualization_msgs::msg::MarkerArray>("~/debug/stop_wall_marker", 1);
create_publisher<visualization_msgs::msg::MarkerArray>("~/virtual_wall", 1);
debug_marker_pub_ = create_publisher<visualization_msgs::msg::MarkerArray>("~/debug/marker", 1);

// longitudinal_info
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -20,8 +20,13 @@
#include "obstacle_cruise_planner/utils.hpp"
#include "tier4_autoware_utils/tier4_autoware_utils.hpp"

#include <tf2/utils.h>
#ifdef ROS_DISTRO_GALACTIC
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#else
#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
#endif

#include <tf2/utils.h>

constexpr double ZERO_VEL_THRESHOLD = 0.01;
constexpr double CLOSE_S_DIST_THRESHOLD = 1e-3;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -108,7 +108,7 @@ geometry_msgs::msg::Pose lerpByPose(
tf2::slerp(tf_transform1.getRotation(), tf_transform2.getRotation(), t);

geometry_msgs::msg::Pose pose;
pose.position = toMsg(tf_point);
pose.position = ::toMsg(tf_point);
pose.orientation = tf2::toMsg(tf_quaternion);
return pose;
}
Expand Down

0 comments on commit b9f8dde

Please sign in to comment.