Skip to content

Commit

Permalink
Revert "Merge branch 'main' into feat/planning/fix_dwaP_member_scope"
Browse files Browse the repository at this point in the history
This reverts commit ac6629f, reversing
changes made to d118d11.
  • Loading branch information
Autumn60 committed Jul 14, 2024
1 parent ac6629f commit bd51497
Show file tree
Hide file tree
Showing 3 changed files with 11 additions and 75 deletions.

This file was deleted.

9 changes: 9 additions & 0 deletions src/planning/dwa_planner/include/dwa_planner/dwa_planner.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -9,6 +9,7 @@
#include <nav_msgs/msg/occupancy_grid.hpp>
#include <nav_msgs/msg/odometry.hpp>

#include <algorithm>
#include <vector>

namespace dwa_planner
Expand Down Expand Up @@ -72,6 +73,14 @@ class DWAPlanner : public rclcpp::Node
double calculate_stage_cost(const State & state);
double calculate_terminal_cost(const State & state);

inline static double lerp(const double a, const double b, double t)
{
t = std::max(0.0, std::min(1.0, t));
return a + t * (b - a);
}

rclcpp::TimerBase::SharedPtr update_timer_;

OccupancyGridSubscription::SharedPtr map_sub_;
OdometrySubscription::SharedPtr odom_sub_;
PoseStampedSubscription::SharedPtr goal_sub_;
Expand Down
7 changes: 2 additions & 5 deletions src/planning/dwa_planner/src/dwa_planner.cpp
Original file line number Diff line number Diff line change
@@ -1,7 +1,5 @@
#include "dwa_planner/dwa_planner.hpp"

#include <wheel_stuck_utils/math/math.hpp>

#include <limits>

namespace dwa_planner
Expand Down Expand Up @@ -185,10 +183,9 @@ DWAPlanner::Trajectory DWAPlanner::planning()
Trajectory best_trajectory;

for (int v = 0; v < velocity_resolution_; v++) {
double velocity = wheel_stuck_utils::math::lerp(
window.min_velocity, window.max_velocity, v * velocity_resolution_inv_);
double velocity = lerp(window.min_velocity, window.max_velocity, v * velocity_resolution_inv_);
for (int a = 0; a < angular_velocity_resolution_; a++) {
double angular_velocity = wheel_stuck_utils::math::lerp(
double angular_velocity = lerp(
window.min_angular_velocity, window.max_angular_velocity,
a * angular_velocity_resolution_inv_);

Expand Down

0 comments on commit bd51497

Please sign in to comment.