SMACC2
|
#include <forward_local_planner.hpp>
Public Member Functions | |
ForwardLocalPlanner () | |
virtual | ~ForwardLocalPlanner () |
void | configure (const rclcpp_lifecycle::LifecycleNode::WeakPtr &parent, std::string name, const std::shared_ptr< tf2_ros::Buffer > &tf, const std::shared_ptr< nav2_costmap_2d::Costmap2DROS > &costmap_ros) override |
void | activate () override |
void | deactivate () override |
void | cleanup () override |
void | setPlan (const nav_msgs::msg::Path &path) override |
nav2_core setPlan - Sets the global plan More... | |
virtual geometry_msgs::msg::TwistStamped | computeVelocityCommands (const geometry_msgs::msg::PoseStamped &pose, const geometry_msgs::msg::Twist &velocity, nav2_core::GoalChecker *goal_checker) override |
nav2_core computeVelocityCommands - calculates the best command given the current pose and velocity More... | |
bool | isGoalReached () |
virtual void | setSpeedLimit (const double &speed_limit, const bool &percentage) override |
Private Member Functions | |
void | updateParameters () |
void | publishGoalMarker (double x, double y, double phi) |
void | cleanMarkers () |
void | generateTrajectory (const Eigen::Vector3f &pos, const Eigen::Vector3f &vel, float maxdist, float maxangle, float maxtime, float dt, std::vector< Eigen::Vector3f > &outtraj) |
Eigen::Vector3f | computeNewPositions (const Eigen::Vector3f &pos, const Eigen::Vector3f &vel, double dt) |
Private Attributes | |
nav2_util::LifecycleNode::SharedPtr | nh_ |
std::shared_ptr< nav2_costmap_2d::Costmap2DROS > | costmapRos_ |
std::string | name_ |
rclcpp_lifecycle::LifecyclePublisher< visualization_msgs::msg::MarkerArray >::SharedPtr | goalMarkerPublisher_ |
double | k_rho_ |
double | k_alpha_ |
double | k_betta_ |
bool | goalReached_ |
const double | alpha_offset_ = 0 |
const double | betta_offset_ = 0 |
meter | carrot_distance_ |
rad | carrot_angular_distance_ |
double | yaw_goal_tolerance_ |
double | xy_goal_tolerance_ |
double | max_angular_z_speed_ |
double | max_linear_x_speed_ |
double | transform_tolerance_ |
int | currentPoseIndex_ |
std::vector< geometry_msgs::msg::PoseStamped > | plan_ |
bool | waiting_ |
rclcpp::Duration | waitingTimeout_ |
rclcpp::Time | waitingStamp_ |
std::shared_ptr< tf2_ros::Buffer > | tf_ |
Definition at line 39 of file forward_local_planner.hpp.
cl_nav2z::forward_local_planner::ForwardLocalPlanner::ForwardLocalPlanner | ( | ) |
Definition at line 43 of file forward_local_planner.cpp.
|
virtual |
Definition at line 45 of file forward_local_planner.cpp.
|
override |
Definition at line 47 of file forward_local_planner.cpp.
References goalMarkerPublisher_, nh_, and updateParameters().
|
private |
Definition at line 265 of file forward_local_planner.cpp.
References costmapRos_, goalMarkerPublisher_, and nh_.
Referenced by cleanup(), and deactivate().
|
override |
Definition at line 60 of file forward_local_planner.cpp.
References cleanMarkers(), currentPoseIndex_, plan_, xy_goal_tolerance_, and yaw_goal_tolerance_.
|
private |
Definition at line 213 of file forward_local_planner.cpp.
Referenced by generateTrajectory().
|
overridevirtual |
nav2_core computeVelocityCommands - calculates the best command given the current pose and velocity
It is presumed that the global plan is already set.
This is mostly a wrapper for the protected computeVelocityCommands function which has additional debugging info.
pose | Current robot pose |
velocity | Current robot velocity |
Definition at line 322 of file forward_local_planner.cpp.
References alpha_offset_, betta_offset_, carrot_distance_, costmapRos_, currentPoseIndex_, generateTrajectory(), goalReached_, k_alpha_, k_betta_, k_rho_, max_angular_z_speed_, max_linear_x_speed_, nh_, plan_, publishGoalMarker(), updateParameters(), waiting_, waitingStamp_, waitingTimeout_, xy_goal_tolerance_, and yaw_goal_tolerance_.
|
override |
Definition at line 69 of file forward_local_planner.cpp.
References carrot_distance_, costmapRos_, currentPoseIndex_, declareOrSet(), goalMarkerPublisher_, goalReached_, k_alpha_, k_betta_, k_rho_, max_angular_z_speed_, max_linear_x_speed_, name_, nh_, service_node_3::s, tf_, transform_tolerance_, waiting_, waitingTimeout_, xy_goal_tolerance_, and yaw_goal_tolerance_.
|
override |
Definition at line 54 of file forward_local_planner.cpp.
References cleanMarkers(), and goalMarkerPublisher_.
|
private |
Definition at line 148 of file forward_local_planner.cpp.
References computeNewPositions().
Referenced by computeVelocityCommands().
bool cl_nav2z::forward_local_planner::ForwardLocalPlanner::isGoalReached | ( | ) |
|
private |
Definition at line 228 of file forward_local_planner.cpp.
References costmapRos_, goalMarkerPublisher_, nh_, and service_node_3::s.
Referenced by computeVelocityCommands().
|
override |
nav2_core setPlan - Sets the global plan
path | The global plan |
Definition at line 651 of file forward_local_planner.cpp.
References costmapRos_, goalReached_, plan_, tf_, and transform_tolerance_.
|
overridevirtual |
Definition at line 631 of file forward_local_planner.cpp.
References nh_.
|
private |
Definition at line 119 of file forward_local_planner.cpp.
References carrot_distance_, k_alpha_, k_betta_, k_rho_, max_angular_z_speed_, max_linear_x_speed_, name_, nh_, transform_tolerance_, xy_goal_tolerance_, and yaw_goal_tolerance_.
Referenced by activate(), and computeVelocityCommands().
|
private |
Definition at line 106 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands().
|
private |
Definition at line 107 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands().
|
private |
Definition at line 110 of file forward_local_planner.hpp.
|
private |
Definition at line 109 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands(), configure(), and updateParameters().
|
private |
Definition at line 95 of file forward_local_planner.hpp.
Referenced by cleanMarkers(), computeVelocityCommands(), configure(), publishGoalMarker(), and setPlan().
|
private |
Definition at line 120 of file forward_local_planner.hpp.
Referenced by cleanup(), computeVelocityCommands(), and configure().
|
private |
Definition at line 99 of file forward_local_planner.hpp.
Referenced by activate(), cleanMarkers(), configure(), deactivate(), and publishGoalMarker().
|
private |
Definition at line 104 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands(), configure(), isGoalReached(), and setPlan().
|
private |
Definition at line 102 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands(), configure(), and updateParameters().
|
private |
Definition at line 103 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands(), configure(), and updateParameters().
|
private |
Definition at line 101 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands(), configure(), and updateParameters().
|
private |
Definition at line 115 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands(), configure(), and updateParameters().
|
private |
Definition at line 116 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands(), configure(), and updateParameters().
|
private |
Definition at line 96 of file forward_local_planner.hpp.
Referenced by configure(), and updateParameters().
|
private |
Definition at line 84 of file forward_local_planner.hpp.
Referenced by activate(), cleanMarkers(), computeVelocityCommands(), configure(), publishGoalMarker(), setSpeedLimit(), and updateParameters().
|
private |
Definition at line 122 of file forward_local_planner.hpp.
Referenced by cleanup(), computeVelocityCommands(), and setPlan().
|
private |
Definition at line 127 of file forward_local_planner.hpp.
Referenced by configure(), and setPlan().
|
private |
Definition at line 117 of file forward_local_planner.hpp.
Referenced by configure(), setPlan(), and updateParameters().
|
private |
Definition at line 124 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands(), and configure().
|
private |
Definition at line 126 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands().
|
private |
Definition at line 125 of file forward_local_planner.hpp.
Referenced by computeVelocityCommands(), and configure().
|
private |
Definition at line 113 of file forward_local_planner.hpp.
Referenced by cleanup(), computeVelocityCommands(), configure(), and updateParameters().
|
private |
Definition at line 112 of file forward_local_planner.hpp.
Referenced by cleanup(), computeVelocityCommands(), configure(), and updateParameters().