#include <ftc_planner.h>
Definition at line 42 of file ftc_planner.h.
ftc_local_planner::FTCPlanner::FTCPlanner |
( |
| ) |
|
ftc_local_planner::FTCPlanner::~FTCPlanner |
( |
| ) |
|
double ftc_local_planner::FTCPlanner::calculateGlobalPlanAngle |
( |
tf::Stamped< tf::Pose > |
current_pose, |
|
|
const std::vector< geometry_msgs::PoseStamped > & |
plan, |
|
|
int |
points |
|
) |
| |
|
private |
Calculate the orientation of the global plan.
- Parameters
-
current | robot pose |
global | plan |
number | of points which used for calculation |
Definition at line 228 of file ftc_planner.cpp.
bool ftc_local_planner::FTCPlanner::checkCollision |
( |
int |
max_points | ) |
|
|
private |
Check if the considerd points are in local collision.
- Parameters
-
points | of global plan which are considerd. |
- Returns
- true if no collision.
Definition at line 457 of file ftc_planner.cpp.
int ftc_local_planner::FTCPlanner::checkMaxAngle |
( |
int |
points, |
|
|
tf::Stamped< tf::Pose > |
current_pose |
|
) |
| |
|
private |
Goes backward along global plan the max angle whith sim_time and max_rotation_vel allow.
- Parameters
-
point | where starts to go backward |
current | pose of the robot |
- Returns
- max point of the global plan with can reached
Definition at line 210 of file ftc_planner.cpp.
Goes along global plan the max distance whith sim_time and max_x_vel allow.
- Parameters
-
- Returns
- max point of the global plan with can reached
Definition at line 179 of file ftc_planner.cpp.
bool ftc_local_planner::FTCPlanner::computeVelocityCommands |
( |
geometry_msgs::Twist & |
cmd_vel | ) |
|
|
virtual |
Given the current position, orientation, and velocity of the robot, compute velocity commands to send to the base.
- Parameters
-
cmd_vel | Will be filled with the velocity command to be passed to the robot base |
- Returns
- True if a valid velocity command was found, false otherwise
Implements nav_core::BaseLocalPlanner.
Definition at line 107 of file ftc_planner.cpp.
int ftc_local_planner::FTCPlanner::driveToward |
( |
tf::Stamped< tf::Pose > |
current_pose, |
|
|
geometry_msgs::Twist & |
cmd_vel |
|
) |
| |
|
private |
Drive along the global plan and calculate the velocity.
- Parameters
-
current | pose of the robot |
velocity | message |
- Returns
- number of points of global plan which are used
Definition at line 339 of file ftc_planner.cpp.
Constructs the local planner.
- Parameters
-
name | The name to give this instance of the local planner |
tf | A pointer to a transform listener |
costmap_ros | The cost map to use for assigning costs to local plans |
Implements nav_core::BaseLocalPlanner.
Definition at line 33 of file ftc_planner.cpp.
bool ftc_local_planner::FTCPlanner::isGoalReached |
( |
| ) |
|
|
virtual |
void ftc_local_planner::FTCPlanner::publishPlan |
( |
int |
max_point | ) |
|
|
private |
Publish the global plan for visulatation.
- Parameters
-
points | where jused to calculate plan. |
Definition at line 492 of file ftc_planner.cpp.
void ftc_local_planner::FTCPlanner::reconfigureCB |
( |
FTCPlannerConfig & |
config, |
|
|
uint32_t |
level |
|
) |
| |
|
private |
bool ftc_local_planner::FTCPlanner::rotateToOrientation |
( |
double |
angle, |
|
|
geometry_msgs::Twist & |
cmd_vel, |
|
|
double |
accuracy |
|
) |
| |
|
private |
Rotation at place.
- Parameters
-
angle | which is to rotate |
velocity | message which is calculate for rotation |
accuracy | of orientation |
- Returns
- true if rotate, false if rotation goal reached
Definition at line 253 of file ftc_planner.cpp.
bool ftc_local_planner::FTCPlanner::setPlan |
( |
const std::vector< geometry_msgs::PoseStamped > & |
plan | ) |
|
|
virtual |
Set the plan that the local planner is following.
- Parameters
-
plan | The plan to pass to the local planner |
- Returns
- True if the plan was updated successfully, false otherwise
Implements nav_core::BaseLocalPlanner.
Definition at line 67 of file ftc_planner.cpp.
double ftc_local_planner::FTCPlanner::cmd_vel_angular_z_ |
|
private |
double ftc_local_planner::FTCPlanner::cmd_vel_angular_z_rotate_ |
|
private |
double ftc_local_planner::FTCPlanner::cmd_vel_linear_x_ |
|
private |
ftc_local_planner::FTCPlannerConfig ftc_local_planner::FTCPlanner::config_ |
|
private |
ftc_local_planner::FTCPlannerConfig ftc_local_planner::FTCPlanner::default_config_ |
|
private |
dynamic_reconfigure::Server<FTCPlannerConfig>* ftc_local_planner::FTCPlanner::dsrv_ |
|
private |
bool ftc_local_planner::FTCPlanner::first_setPlan_ |
|
private |
std::vector<geometry_msgs::PoseStamped> ftc_local_planner::FTCPlanner::global_plan_ |
|
private |
bool ftc_local_planner::FTCPlanner::goal_reached_ |
|
private |
JoinCostmap* ftc_local_planner::FTCPlanner::joinCostmap_ |
|
private |
bool ftc_local_planner::FTCPlanner::rotate_to_global_plan_ |
|
private |
bool ftc_local_planner::FTCPlanner::stand_at_goal_ |
|
private |
std::vector<geometry_msgs::PoseStamped> ftc_local_planner::FTCPlanner::transformed_global_plan_ |
|
private |
The documentation for this class was generated from the following files: