#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... | |
PointRobotFootprint (const double min_obstacle_dist) | |
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 | ~PointRobotFootprint () |
Virtual destructor. More... | |
![]() | |
BaseRobotFootprintModel () | |
Default constructor of the abstract obstacle class. More... | |
virtual | ~BaseRobotFootprintModel () |
Virtual destructor. More... | |
Private Attributes | |
const double | min_obstacle_dist_ = 0.0 |
Definition at line 170 of file robot_footprint_model.h.
|
inline |
Default constructor of the abstract obstacle class.
Definition at line 177 of file robot_footprint_model.h.
|
inline |
Default constructor of the abstract obstacle class.
min_obstacle_dist | Minimum obstacle distance |
Definition at line 183 of file robot_footprint_model.h.
|
inlinevirtual |
Virtual destructor.
Definition at line 188 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 196 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 208 of file robot_footprint_model.h.
|
inlinevirtual |
Compute the inscribed radius of the footprint model.
Implements teb_local_planner::BaseRobotFootprintModel.
Definition at line 217 of file robot_footprint_model.h.
|
inlinevirtual |
Visualize the robot using a markers.
Fill a marker message with all necessary information (type, pose, scale and color). The header, namespace, id and marker lifetime will be overwritten.
current_pose | Current robot pose | |
[out] | markers | container of marker messages describing the robot shape |
color | Color of the footprint |
Reimplemented from teb_local_planner::BaseRobotFootprintModel.
Definition at line 228 of file robot_footprint_model.h.
|
private |
Definition at line 264 of file robot_footprint_model.h.