Namespaces | Functions
conversions_and_types.cpp File Reference
#include <eband_local_planner/conversions_and_types.h>
Include dependency graph for conversions_and_types.cpp:

Go to the source code of this file.

Namespaces

 eband_local_planner
 

Functions

double eband_local_planner::getCircumscribedRadius (costmap_2d::Costmap2DROS &costmap)
 Gets the footprint of the robot and computes the circumscribed radius for the eband approach. More...
 
void eband_local_planner::Pose2DToPose (geometry_msgs::Pose &pose, const geometry_msgs::Pose2D pose2D)
 Converts a frame of type Pose to type Pose2D (mainly -> conversion of orientation from euler angles to quaternions, -> z-coordinate is set to zero) More...
 
void eband_local_planner::PoseToPose2D (const geometry_msgs::Pose pose, geometry_msgs::Pose2D &pose2D)
 Converts a frame of type Pose to type Pose2D (mainly -> conversion of orientation from quaternions to euler angles) More...
 
bool eband_local_planner::transformGlobalPlan (const tf::TransformListener &tf, const std::vector< geometry_msgs::PoseStamped > &global_plan, costmap_2d::Costmap2DROS &costmap, const std::string &global_frame, std::vector< geometry_msgs::PoseStamped > &transformed_plan, std::vector< int > &start_end_counts_from_end)
 Transforms the global plan of the robot from the planner frame to the local frame. This replaces the transformGlobalPlan as defined in the base_local_planner/goal_functions.h main difference is that it additionally outputs counter indicating which part of the plan has been transformed. More...
 


eband_local_planner
Author(s): Christian Connette, Bhaskara Marthi, Piyush Khandelwal
autogenerated on Sat Feb 22 2020 04:03:28