calcCentroid() | teb_local_planner::PolygonObstacle | protected |
centroid_ | teb_local_planner::PolygonObstacle | protected |
centroid_velocity_ | teb_local_planner::Obstacle | protected |
checkCollision(const Eigen::Vector2d &point, double min_dist) const | teb_local_planner::PolygonObstacle | inlinevirtual |
checkLineIntersection(const Eigen::Vector2d &line_start, const Eigen::Vector2d &line_end, double min_dist=0) const | teb_local_planner::PolygonObstacle | virtual |
clearVertices() | teb_local_planner::PolygonObstacle | inline |
dynamic_ | teb_local_planner::Obstacle | protected |
finalized_ | teb_local_planner::PolygonObstacle | protected |
finalizePolygon() | teb_local_planner::PolygonObstacle | inline |
fixPolygonClosure() | teb_local_planner::PolygonObstacle | protected |
getCentroid() const | teb_local_planner::PolygonObstacle | inlinevirtual |
getCentroidCplx() const | teb_local_planner::PolygonObstacle | inlinevirtual |
getCentroidVelocity() const | teb_local_planner::Obstacle | inline |
getClosestPoint(const Eigen::Vector2d &position) const | teb_local_planner::PolygonObstacle | virtual |
getMinimumDistance(const Eigen::Vector2d &position) const | teb_local_planner::PolygonObstacle | inlinevirtual |
getMinimumDistance(const Eigen::Vector2d &line_start, const Eigen::Vector2d &line_end) const | teb_local_planner::PolygonObstacle | inlinevirtual |
getMinimumDistance(const Point2dContainer &polygon) const | teb_local_planner::PolygonObstacle | inlinevirtual |
getMinimumSpatioTemporalDistance(const Eigen::Vector2d &position, double t) const | teb_local_planner::PolygonObstacle | inlinevirtual |
getMinimumSpatioTemporalDistance(const Eigen::Vector2d &line_start, const Eigen::Vector2d &line_end, double t) const | teb_local_planner::PolygonObstacle | inlinevirtual |
getMinimumSpatioTemporalDistance(const Point2dContainer &polygon, double t) const | teb_local_planner::PolygonObstacle | inlinevirtual |
isDynamic() const | teb_local_planner::Obstacle | inline |
noVertices() const | teb_local_planner::PolygonObstacle | inline |
Obstacle() | teb_local_planner::Obstacle | inline |
PolygonObstacle() | teb_local_planner::PolygonObstacle | inline |
PolygonObstacle(const Point2dContainer &vertices) | teb_local_planner::PolygonObstacle | inline |
predictCentroidConstantVelocity(double t, Eigen::Ref< Eigen::Vector2d > position) const | teb_local_planner::Obstacle | inlinevirtual |
predictVertices(double t, Point2dContainer &pred_vertices) const | teb_local_planner::PolygonObstacle | inlinevirtual |
pushBackVertex(const Eigen::Ref< const Eigen::Vector2d > &vertex) | teb_local_planner::PolygonObstacle | inline |
pushBackVertex(double x, double y) | teb_local_planner::PolygonObstacle | inline |
setCentroidVelocity(const Eigen::Ref< const Eigen::Vector2d > &vel) | teb_local_planner::Obstacle | inline |
setCentroidVelocity(const geometry_msgs::TwistWithCovariance &velocity, const geometry_msgs::Quaternion &orientation) | teb_local_planner::Obstacle | inline |
setCentroidVelocity(const geometry_msgs::TwistWithCovariance &velocity, const geometry_msgs::QuaternionStamped &orientation) | teb_local_planner::Obstacle | inline |
toPolygonMsg(geometry_msgs::Polygon &polygon) | teb_local_planner::PolygonObstacle | virtual |
toTwistWithCovarianceMsg(geometry_msgs::TwistWithCovariance &twistWithCovariance) | teb_local_planner::Obstacle | inlinevirtual |
vertices() const | teb_local_planner::PolygonObstacle | inline |
vertices() | teb_local_planner::PolygonObstacle | inline |
vertices_ | teb_local_planner::PolygonObstacle | protected |
~Obstacle() | teb_local_planner::Obstacle | inlinevirtual |