Namespaces | Macros | Functions
goal_functions.cpp File Reference
#include <base_local_planner/goal_functions.h>
#include <tf2/LinearMath/Matrix3x3.h>
#include <tf2/utils.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
Include dependency graph for goal_functions.cpp:

Go to the source code of this file.

Namespaces

 base_local_planner
 

Macros

#define GOAL_ATTRIBUTE_UNUSED   __attribute__ ((unused))
 

Functions

double base_local_planner::getGoalOrientationAngleDifference (const geometry_msgs::PoseStamped &global_pose, double goal_th)
 return angle difference to goal to check if the goal orientation has been achieved More...
 
bool base_local_planner::getGoalPose (const tf2_ros::Buffer &tf, const std::vector< geometry_msgs::PoseStamped > &global_plan, const std::string &global_frame, geometry_msgs::PoseStamped &goal_pose)
 Returns last pose in plan. More...
 
double base_local_planner::getGoalPositionDistance (const geometry_msgs::PoseStamped &global_pose, double goal_x, double goal_y)
 return squared distance to check if the goal position has been achieved More...
 
bool base_local_planner::isGoalReached (const tf2_ros::Buffer &tf, const std::vector< geometry_msgs::PoseStamped > &global_plan, const costmap_2d::Costmap2D &costmap GOAL_ATTRIBUTE_UNUSED, const std::string &global_frame, geometry_msgs::PoseStamped &global_pose, const nav_msgs::Odometry &base_odom, double rot_stopped_vel, double trans_stopped_vel, double xy_goal_tolerance, double yaw_goal_tolerance)
 
void base_local_planner::prunePlan (const geometry_msgs::PoseStamped &global_pose, std::vector< geometry_msgs::PoseStamped > &plan, std::vector< geometry_msgs::PoseStamped > &global_plan)
 Trim off parts of the global plan that are far enough behind the robot. More...
 
void base_local_planner::publishPlan (const std::vector< geometry_msgs::PoseStamped > &path, const ros::Publisher &pub)
 Publish a plan for visualization purposes. More...
 
bool base_local_planner::stopped (const nav_msgs::Odometry &base_odom, const double &rot_stopped_velocity, const double &trans_stopped_velocity)
 Check whether the robot is stopped or not. More...
 
bool base_local_planner::transformGlobalPlan (const tf2_ros::Buffer &tf, const std::vector< geometry_msgs::PoseStamped > &global_plan, const geometry_msgs::PoseStamped &global_robot_pose, const costmap_2d::Costmap2D &costmap, const std::string &global_frame, std::vector< geometry_msgs::PoseStamped > &transformed_plan)
 Transforms the global plan of the robot from the planner frame to the frame of the costmap, selects only the (first) part of the plan that is within the costmap area. More...
 

Macro Definition Documentation

◆ GOAL_ATTRIBUTE_UNUSED

#define GOAL_ATTRIBUTE_UNUSED   __attribute__ ((unused))

Definition at line 44 of file goal_functions.cpp.



base_local_planner
Author(s): Eitan Marder-Eppstein, Eric Perko, contradict@gmail.com
autogenerated on Mon Mar 6 2023 03:50:24