#include <robot_footprint_model.h>
Public Member Functions | |
virtual double | calculateDistance (const PoseSE2 ¤t_pose, const Obstacle *obstacle) const |
Calculate the distance between the robot and an obstacle. More... | |
virtual double | estimateSpatioTemporalDistance (const PoseSE2 ¤t_pose, const Obstacle *obstacle, double t) const |
Estimate the distance between the robot and the predicted location of an obstacle at time t. More... | |
virtual double | getInscribedRadius () |
Compute the inscribed radius of the footprint model. More... | |
PointRobotFootprint () | |
Default constructor of the abstract obstacle class. More... | |
virtual | ~PointRobotFootprint () |
Virtual destructor. More... | |
Public Member Functions inherited from teb_local_planner::BaseRobotFootprintModel | |
BaseRobotFootprintModel () | |
Default constructor of the abstract obstacle class. More... | |
virtual void | visualizeRobot (const PoseSE2 ¤t_pose, std::vector< visualization_msgs::Marker > &markers, const std_msgs::ColorRGBA &color) const |
Visualize the robot using a markers. More... | |
virtual | ~BaseRobotFootprintModel () |
Virtual destructor. More... | |
Definition at line 134 of file robot_footprint_model.h.
|
inline |
Default constructor of the abstract obstacle class.
Definition at line 141 of file robot_footprint_model.h.
|
inlinevirtual |
Virtual destructor.
Definition at line 146 of file robot_footprint_model.h.
|
inlinevirtual |
Calculate the distance between the robot and an obstacle.
current_pose | Current robot pose |
obstacle | Pointer to the obstacle |
Implements teb_local_planner::BaseRobotFootprintModel.
Definition at line 154 of file robot_footprint_model.h.
|
inlinevirtual |
Estimate the distance between the robot and the predicted location of an obstacle at time t.
current_pose | robot pose, from which the distance to the obstacle is estimated |
obstacle | Pointer to the dynamic obstacle (constant velocity model is assumed) |
t | time, for which the predicted distance to the obstacle is calculated |
Implements teb_local_planner::BaseRobotFootprintModel.
Definition at line 166 of file robot_footprint_model.h.
|
inlinevirtual |
Compute the inscribed radius of the footprint model.
Implements teb_local_planner::BaseRobotFootprintModel.
Definition at line 175 of file robot_footprint_model.h.