#include <teb_local_planner/homotopy_class_planner.h>
Go to the source code of this file.
Namespaces | |
namespace | teb_local_planner |
Functions | |
std::complex< long double > | teb_local_planner::getCplxFromHcGraph (HcGraphVertexType vert_descriptor, const HcGraph &graph) |
Inline function used for calculateHSignature() in combination with HCP graph vertex descriptors. | |
std::complex< long double > | teb_local_planner::getCplxFromMsgPoseStamped (const geometry_msgs::PoseStamped &pose) |
Inline function used for calculateHSignature() in combination with geometry_msgs::PoseStamped. | |
std::complex< long double > | teb_local_planner::getCplxFromVertexPosePtr (const VertexPose *pose) |
< Inline function used for calculateHSignature() in combination with VertexPose pointers | |
const Eigen::Vector2d & | teb_local_planner::getVector2dFromHcGraph (HcGraphVertexType vert_descriptor, const HcGraph &graph) |
Inline function used for initializing the TEB in combination with HCP graph vertex descriptors. |