44 #ifndef EDGE_DYNAMICOBSTACLE_H 45 #define EDGE_DYNAMICOBSTACLE_H 103 ROS_ASSERT_MSG(std::isfinite(_error[0]),
"EdgeDynamicObstacle::computeError() _error[0]=%f\n",_error[0]);
113 _measurement = obstacle;
135 _measurement = obstacle;
144 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
double penaltyBoundFromBelow(const double &var, const double &a, const double &epsilon)
Linear penalty function for bounding var from below: .
PoseSE2 & pose()
Access the pose.
Edge defining the cost function for keeping a distance from dynamic (moving) obstacles.
double min_obstacle_dist
Minimum desired separation from obstacles.
void setRobotModel(const BaseRobotFootprintModel *robot_model)
Set pointer to the robot model.
Config class for the teb_local_planner and its components.
EdgeDynamicObstacle(double t)
Construct edge and specify the time for its associated pose (neccessary for computeError).
const TebConfig * cfg_
Store TebConfig class for parameters.
void computeError()
Actual cost function.
double t_
Estimated time until current pose is reached.
const BaseRobotFootprintModel * robot_model_
Store pointer to robot_model.
#define ROS_ASSERT_MSG(cond,...)
double penalty_epsilon
Add a small safety margin to penalty functions for hard-constraint approximations.
void setObstacle(const Obstacle *obstacle)
Set Obstacle for the underlying cost function.
EdgeDynamicObstacle()
Construct edge.
void setParameters(const TebConfig &cfg, const BaseRobotFootprintModel *robot_model, const Obstacle *obstacle)
Set all parameters at once.
This class stores and wraps a SE2 pose (position and orientation) into a vertex that can be optimized...
double dynamic_obstacle_inflation_dist
Buffer zone around predicted locations of dynamic obstacles with non-zero penalty costs (should be la...
struct teb_local_planner::TebConfig::Optimization optim
Optimization related parameters.
Base edge connecting a single vertex in the TEB optimization problem.
struct teb_local_planner::TebConfig::Obstacles obstacles
Obstacle related parameters.
Abstract class that defines the interface for modelling obstacles.