30 #include <boost/algorithm/string.hpp> 33 #include <mbf_msgs/ExePathResult.h> 45 : _costmap_ros(nullptr),
47 _costmap_model(nullptr),
48 _costmap_converter_loader(
"costmap_converter",
"costmap_converter::BaseCostmapToPolygons"),
51 _no_infeasible_plans(0),
109 _costmap_model = std::make_shared<base_local_planner::CostmapModel>(*_costmap);
120 ROS_ERROR(
"Controller configuration failed.");
135 boost::replace_all(converter_name,
"::",
"/");
147 "The specified costmap converter plugin cannot be loaded. All occupied costmap cells are treaten as point obstacles. Error " 154 ROS_INFO(
"No costmap conversion plugin specified. All occupied costmap cells are treaten as point obstacles.");
187 ROS_DEBUG(
"mpc_local_planner plugin initialized.");
191 ROS_WARN(
"mpc_local_planner has already been initialized, doing nothing.");
200 ROS_ERROR(
"mpc_local_planner has not been initialized, please call initialize() before using this planner");
219 std::string dummy_message;
220 geometry_msgs::PoseStamped dummy_pose;
221 geometry_msgs::TwistStamped dummy_velocity, cmd_vel_stamped;
223 cmd_vel = cmd_vel_stamped.twist;
224 return outcome == mbf_msgs::ExePathResult::SUCCESS;
228 geometry_msgs::TwistStamped& cmd_vel, std::string& message)
233 ROS_ERROR(
"mpc_local_planner has not been initialized, please call initialize() before using this planner");
234 message =
"mpc_local_planner has not been initialized";
235 return mbf_msgs::ExePathResult::NOT_INITIALIZED;
238 static uint32_t seq = 0;
239 cmd_vel.header.seq = seq++;
242 cmd_vel.twist.linear.x = cmd_vel.twist.linear.y = cmd_vel.twist.angular.z = 0;
246 geometry_msgs::PoseStamped robot_pose;
251 geometry_msgs::PoseStamped robot_vel_tf;
253 _robot_vel.linear.x = robot_vel_tf.pose.position.x;
254 _robot_vel.linear.y = robot_vel_tf.pose.position.y;
261 std::vector<geometry_msgs::PoseStamped> transformed_plan;
263 geometry_msgs::TransformStamped tf_plan_to_global;
265 &goal_idx, &tf_plan_to_global))
267 ROS_WARN(
"Could not transform the global plan to the frame of the controller");
268 message =
"Could not transform the global plan to the frame of the controller";
269 return mbf_msgs::ExePathResult::INTERNAL_ERROR;
276 geometry_msgs::PoseStamped global_goal;
278 double dx = global_goal.pose.position.x -
_robot_pose.
x();
279 double dy = global_goal.pose.position.y -
_robot_pose.
y();
284 return mbf_msgs::ExePathResult::SUCCESS;
288 if (transformed_plan.empty())
290 ROS_WARN(
"Transformed plan is empty. Cannot determine a local plan.");
291 message =
"Transformed plan is empty";
292 return mbf_msgs::ExePathResult::INVALID_PATH;
296 _robot_goal.
x() = transformed_plan.back().pose.position.x;
297 _robot_goal.
y() = transformed_plan.back().pose.position.y;
305 tf2::convert(q, transformed_plan.back().pose.orientation);
313 if (transformed_plan.size() == 1)
315 transformed_plan.insert(transformed_plan.begin(), geometry_msgs::PoseStamped());
317 transformed_plan.front() = robot_pose;
350 bool success =
false;
361 ROS_WARN(
"mpc_local_planner was not able to obtain a local plan for the current setting.");
366 message =
"mpc_local_planner was not able to obtain a local plan";
367 return mbf_msgs::ExePathResult::NO_VALID_CMD;
382 cmd_vel.twist.linear.x = cmd_vel.twist.linear.y = cmd_vel.twist.angular.z = 0;
386 ROS_WARN(
"MpcLocalPlannerROS: trajectory is not feasible. Resetting planner...");
390 message =
"mpc_local_planner trajectory is not feasible";
391 return mbf_msgs::ExePathResult::NO_VALID_CMD;
399 ROS_WARN(
"MpcLocalPlannerROS: velocity command invalid. Resetting controller...");
403 message =
"mpc_local_planner velocity command invalid";
404 return mbf_msgs::ExePathResult::NO_VALID_CMD;
424 return mbf_msgs::ExePathResult::SUCCESS;
471 if (!obstacles)
return;
473 for (std::size_t i = 0; i < obstacles->obstacles.size(); ++i)
475 const costmap_converter::ObstacleMsg* obstacle = &obstacles->obstacles.at(i);
476 const geometry_msgs::Polygon* polygon = &obstacle->polygon;
478 if (polygon->points.size() == 1 && obstacle->radius > 0)
482 else if (polygon->points.size() == 1)
486 else if (polygon->points.size() == 2)
489 ObstaclePtr(
new LineObstacle(polygon->points[0].x, polygon->points[0].y, polygon->points[1].x, polygon->points[1].y)));
491 else if (polygon->points.size() > 2)
494 for (std::size_t j = 0; j < polygon->points.size(); ++j)
496 polyobst->
pushBackVertex(polygon->points[j].x, polygon->points[j].y);
503 if (!
_obstacles.empty())
_obstacles.back()->setCentroidVelocity(obstacles->obstacles[i].velocities, obstacles->obstacles[i].orientation);
518 geometry_msgs::TransformStamped obstacle_to_map =
559 ROS_WARN(
"Invalid custom obstacle received. List of polygon vertices is empty. Skipping...");
587 if (min_separation <= 0)
return;
589 std::size_t prev_idx = 0;
590 for (std::size_t i = 1; i < transformed_plan.size(); ++i)
593 if (
distance_points2d(transformed_plan[prev_idx].pose.position, transformed_plan[i].pose.position) < min_separation)
continue;
596 _via_points.emplace_back(transformed_plan[i].pose);
610 std::vector<geometry_msgs::PoseStamped>& global_plan,
double dist_behind_robot)
612 if (global_plan.empty())
return true;
617 geometry_msgs::TransformStamped global_to_plan_transform =
619 geometry_msgs::PoseStamped robot;
622 double dist_thresh_sq = dist_behind_robot * dist_behind_robot;
625 std::vector<geometry_msgs::PoseStamped>::iterator it = global_plan.begin();
626 std::vector<geometry_msgs::PoseStamped>::iterator erase_end = it;
627 while (it != global_plan.end())
629 double dx = robot.pose.position.x - it->pose.position.x;
630 double dy = robot.pose.position.y - it->pose.position.y;
631 double dist_sq = dx * dx + dy * dy;
632 if (dist_sq < dist_thresh_sq)
639 if (erase_end == global_plan.end())
return false;
641 if (erase_end != global_plan.begin()) global_plan.erase(global_plan.begin(), erase_end);
645 ROS_DEBUG(
"Cannot prune path since no transform is available: %s\n", ex.what());
653 const std::string& global_frame,
double max_plan_length,
654 std::vector<geometry_msgs::PoseStamped>& transformed_plan,
int* current_goal_idx,
655 geometry_msgs::TransformStamped* tf_plan_to_global)
const 659 const geometry_msgs::PoseStamped& plan_pose = global_plan[0];
661 transformed_plan.clear();
665 if (global_plan.empty())
667 ROS_ERROR(
"Received plan with zero length");
668 *current_goal_idx = 0;
673 geometry_msgs::TransformStamped plan_to_global_transform = tf.
lookupTransform(
674 global_frame,
ros::Time(), plan_pose.header.frame_id, plan_pose.header.stamp, plan_pose.header.frame_id,
ros::Duration(0.5));
677 geometry_msgs::PoseStamped robot_pose;
678 tf.
transform(global_pose, robot_pose, plan_pose.header.frame_id);
681 double dist_threshold =
683 dist_threshold *= 0.85;
687 double sq_dist_threshold = dist_threshold * dist_threshold;
688 double sq_dist = 1e10;
691 for (
int j = 0; j < (
int)global_plan.size(); ++j)
693 double x_diff = robot_pose.pose.position.x - global_plan[j].pose.position.x;
694 double y_diff = robot_pose.pose.position.y - global_plan[j].pose.position.y;
695 double new_sq_dist = x_diff * x_diff + y_diff * y_diff;
696 if (new_sq_dist > sq_dist_threshold)
break;
698 if (new_sq_dist < sq_dist)
700 sq_dist = new_sq_dist;
705 geometry_msgs::PoseStamped newer_pose;
707 double plan_length = 0;
710 while (i < (
int)global_plan.size() && sq_dist <= sq_dist_threshold && (max_plan_length <= 0 || plan_length <= max_plan_length))
712 const geometry_msgs::PoseStamped& pose = global_plan[i];
715 transformed_plan.push_back(newer_pose);
717 double x_diff = robot_pose.pose.position.x - global_plan[i].pose.position.x;
718 double y_diff = robot_pose.pose.position.y - global_plan[i].pose.position.y;
719 sq_dist = x_diff * x_diff + y_diff * y_diff;
722 if (i > 0 && max_plan_length > 0)
730 if (transformed_plan.empty())
734 transformed_plan.push_back(newer_pose);
737 if (current_goal_idx) *current_goal_idx =
int(global_plan.size()) - 1;
742 if (current_goal_idx) *current_goal_idx = i - 1;
746 if (tf_plan_to_global) *tf_plan_to_global = plan_to_global_transform;
750 ROS_ERROR(
"No Transform available Error: %s\n", ex.what());
755 ROS_ERROR(
"Connectivity Error: %s\n", ex.what());
760 ROS_ERROR(
"Extrapolation Error: %s\n", ex.what());
761 if (global_plan.size() > 0)
762 ROS_ERROR(
"Global Frame: %s Plan Frame size %d: %s\n", global_frame.c_str(), (
unsigned int)global_plan.size(),
763 global_plan[0].header.frame_id.c_str());
772 const geometry_msgs::PoseStamped& local_goal,
int current_goal_idx,
773 const geometry_msgs::TransformStamped& tf_plan_to_global,
int moving_average_length)
const 775 int n = (
int)global_plan.size();
778 if (current_goal_idx > n - moving_average_length - 2)
780 if (current_goal_idx >= n - 1)
787 tf2::convert(global_plan.back().pose.orientation, global_orientation);
789 tf2::convert(tf_plan_to_global.transform.rotation, rotation);
796 moving_average_length =
797 std::min(moving_average_length, n - current_goal_idx - 1);
799 std::vector<double> candidates;
800 geometry_msgs::PoseStamped tf_pose_k = local_goal;
801 geometry_msgs::PoseStamped tf_pose_kp1;
803 int range_end = current_goal_idx + moving_average_length;
804 for (
int i = current_goal_idx; i < range_end; ++i)
810 candidates.push_back(
811 std::atan2(tf_pose_kp1.pose.position.y - tf_pose_k.pose.position.y, tf_pose_kp1.pose.position.x - tf_pose_k.pose.position.x));
813 if (i < range_end - 1) tf_pose_k = tf_pose_kp1;
820 ROS_WARN_COND(opt_inscribed_radius + min_obst_dist < costmap_inscribed_radius,
821 "The inscribed radius of the footprint specified for TEB optimization (%f) + min_obstacle_dist (%f) are smaller " 822 "than the inscribed radius of the robot's footprint in the costmap parameters (%f, including 'footprint_padding'). " 823 "Infeasible optimziation results might occur frequently!",
824 opt_inscribed_radius, min_obst_dist, costmap_inscribed_radius);
835 ROS_INFO_ONCE(
"Via-points received. This message is printed once.");
839 "Via-points are already obtained from the global plan (global_plan_viapoint_sep>0)." 840 "Ignoring custom via-points.");
847 for (
const geometry_msgs::PoseStamped& pose : via_points_msg->poses)
857 std::string model_name;
858 if (!nh.
getParam(
"footprint_model/type", model_name))
860 ROS_INFO(
"No robot footprint model specified for trajectory optimization. Using point-shaped model.");
861 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
865 if (model_name.compare(
"costmap_2d") == 0)
869 ROS_WARN_STREAM(
"Costmap 2d pointer is null. Using point model instead.");
870 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
872 ROS_INFO(
"Footprint model loaded from costmap_2d for trajectory optimization.");
877 if (model_name.compare(
"point") == 0)
879 ROS_INFO(
"Footprint model 'point' loaded for trajectory optimization.");
880 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
884 if (model_name.compare(
"circular") == 0)
888 if (!nh.
getParam(
"footprint_model/radius", radius))
890 ROS_ERROR_STREAM(
"Footprint model 'circular' cannot be loaded for trajectory optimization, since param '" 891 << nh.
getNamespace() <<
"/footprint_model/radius' does not exist. Using point-model instead.");
892 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
894 ROS_INFO_STREAM(
"Footprint model 'circular' (radius: " << radius <<
"m) loaded for trajectory optimization.");
895 return boost::make_shared<teb_local_planner::CircularRobotFootprint>(radius);
899 if (model_name.compare(
"line") == 0)
902 if (!nh.
hasParam(
"footprint_model/line_start") || !nh.
hasParam(
"footprint_model/line_end"))
904 ROS_ERROR_STREAM(
"Footprint model 'line' cannot be loaded for trajectory optimization, since param '" 905 << nh.
getNamespace() <<
"/footprint_model/line_start' and/or '.../line_end' do not exist. Using point-model instead.");
906 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
910 nh.
getParam(
"footprint_model/line_start", line_start);
911 nh.
getParam(
"footprint_model/line_end", line_end);
912 if (line_start.size() != 2 || line_end.size() != 2)
915 "Footprint model 'line' cannot be loaded for trajectory optimization, since param '" 917 <<
"/footprint_model/line_start' and/or '.../line_end' do not contain x and y coordinates (2D). Using point-model instead.");
918 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
921 ROS_INFO_STREAM(
"Footprint model 'line' (line_start: [" << line_start[0] <<
"," << line_start[1] <<
"]m, line_end: [" << line_end[0] <<
"," 922 << line_end[1] <<
"]m) loaded for trajectory optimization.");
928 if (model_name.compare(
"two_circles") == 0)
931 if (!nh.
hasParam(
"footprint_model/front_offset") || !nh.
hasParam(
"footprint_model/front_radius") ||
932 !nh.
hasParam(
"footprint_model/rear_offset") || !nh.
hasParam(
"footprint_model/rear_radius"))
934 ROS_ERROR_STREAM(
"Footprint model 'two_circles' cannot be loaded for trajectory optimization, since params '" 936 <<
"/footprint_model/front_offset', '.../front_radius', '.../rear_offset' and '.../rear_radius' do not exist. Using " 937 "point-model instead.");
938 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
940 double front_offset, front_radius, rear_offset, rear_radius;
941 nh.
getParam(
"footprint_model/front_offset", front_offset);
942 nh.
getParam(
"footprint_model/front_radius", front_radius);
943 nh.
getParam(
"footprint_model/rear_offset", rear_offset);
944 nh.
getParam(
"footprint_model/rear_radius", rear_radius);
945 ROS_INFO_STREAM(
"Footprint model 'two_circles' (front_offset: " << front_offset <<
"m, front_radius: " << front_radius
946 <<
"m, rear_offset: " << rear_offset <<
"m, rear_radius: " << rear_radius
947 <<
"m) loaded for trajectory optimization.");
948 return boost::make_shared<teb_local_planner::TwoCirclesRobotFootprint>(front_offset, front_radius, rear_offset, rear_radius);
952 if (model_name.compare(
"polygon") == 0)
957 if (!nh.
getParam(
"footprint_model/vertices", footprint_xmlrpc))
959 ROS_ERROR_STREAM(
"Footprint model 'polygon' cannot be loaded for trajectory optimization, since param '" 960 << nh.
getNamespace() <<
"/footprint_model/vertices' does not exist. Using point-model instead.");
961 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
969 ROS_INFO_STREAM(
"Footprint model 'polygon' loaded for trajectory optimization.");
970 return boost::make_shared<teb_local_planner::PolygonRobotFootprint>(polygon);
972 catch (
const std::exception& ex)
974 ROS_ERROR_STREAM(
"Footprint model 'polygon' cannot be loaded for trajectory optimization: " << ex.what()
975 <<
". Using point-model instead.");
976 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
981 ROS_ERROR_STREAM(
"Footprint model 'polygon' cannot be loaded for trajectory optimization, since param '" 983 <<
"/footprint_model/vertices' does not define an array of coordinates. Using point-model instead.");
984 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
990 <<
"/footprint_model/type'. Using point model instead.");
991 return boost::make_shared<teb_local_planner::PointRobotFootprint>();
1000 for (
int i = 0; i < polygon.points.size(); ++i)
1002 pt.x() = polygon.points[i].x;
1003 pt.y() = polygon.points[i].y;
1005 footprint.push_back(pt);
1007 return boost::make_shared<teb_local_planner::PolygonRobotFootprint>(footprint);
1011 const std::string& full_param_name)
1016 ROS_FATAL(
"The footprint must be specified as list of lists on the parameter server, %s was specified as %s", full_param_name.c_str(),
1017 std::string(footprint_xmlrpc).c_str());
1018 throw std::runtime_error(
1019 "The footprint must be specified as list of lists on the parameter server with at least " 1020 "3 points eg: [[x1, y1], [x2, y2], ..., [xn, yn]]");
1026 for (
int i = 0; i < footprint_xmlrpc.
size(); ++i)
1033 "The footprint (parameter %s) must be specified as list of lists on the parameter server eg: " 1034 "[[x1, y1], [x2, y2], ..., [xn, yn]], but this spec is not of that form.",
1035 full_param_name.c_str());
1036 throw std::runtime_error(
1037 "The footprint must be specified as list of lists on the parameter server eg: " 1038 "[[x1, y1], [x2, y2], ..., [xn, yn]], but this spec is not of that form");
1044 footprint.push_back(pt);
1054 std::string& value_string = value;
1055 ROS_FATAL(
"Values in the footprint specification (param %s) must be numbers. Found value %s.", full_param_name.c_str(), value_string.c_str());
1056 throw std::runtime_error(
"Values in the footprint specification must be numbers");
bool _initialized
Keeps track about the correct initialization of this class.
struct mpc_local_planner::MpcLocalPlannerROS::Parameters _params
std::string _global_frame
The frame in which the controller will run.
double estimateLocalGoalOrientation(const std::vector< geometry_msgs::PoseStamped > &global_plan, const geometry_msgs::PoseStamped &local_goal, int current_goal_idx, const geometry_msgs::TransformStamped &tf_plan_to_global, int moving_average_length=3) const
Estimate the orientation of a pose from the global_plan that is treated as a local goal for the local...
RobotDynamicsInterface::Ptr getRobotDynamics()
unsigned int getSizeInCellsX() const
std::vector< geometry_msgs::Point > _footprint_spec
Store the footprint of the robot.
T & transform(const T &in, T &out, const std::string &target_frame, ros::Duration timeout=ros::Duration(0.0)) const
void publishObstacles(const teb_local_planner::ObstContainer &obstacles) const
Publish obstacle positions to the ros topic ../../mpc_markers.
double max_global_plan_lookahead_dist
teb_local_planner::CircularObstacle CircularObstacle
void publishViaPoints(const std::vector< teb_local_planner::PoseSE2 > &via_points, const std::string &ns="ViaPoints") const
Publish via-points to the ros topic ../../teb_markers.
void publishLocalPlan(const std::vector< geometry_msgs::PoseStamped > &local_plan) const
Publish a given local plan to the ros topic ../../local_plan.
MpcLocalPlannerROS()
Default constructor of the plugin.
Eigen::Vector2d orientationUnitVec() const
bool step(const PoseSE2 &start, const PoseSE2 &goal, const geometry_msgs::Twist &vel, double dt, ros::Time t, corbo::TimeSeries::Ptr u_seq, corbo::TimeSeries::Ptr x_seq)
costmap_converter::ObstacleArrayMsg _custom_obstacle_msg
Copy of the most recent obstacle message.
void publishRobotFootprintModel(const teb_local_planner::PoseSE2 ¤t_pose, const teb_local_planner::BaseRobotFootprintModel &robot_model, const std::string &ns="RobotFootprintModel", const std_msgs::ColorRGBA &color=toColorMsg(0.5, 0.0, 0.8, 0.0))
Publish the visualization of the robot model.
unsigned int getSizeInCellsY() const
#define ROS_INFO_ONCE(...)
Eigen::Vector2d & position()
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
RobotFootprintModelPtr _robot_model
bool isGoalReached()
Check if the goal pose has been achieved.
bool transformGlobalPlan(const tf2_ros::Buffer &tf, const std::vector< geometry_msgs::PoseStamped > &global_plan, const geometry_msgs::PoseStamped &global_pose, const costmap_2d::Costmap2D &costmap, const std::string &global_frame, double max_plan_length, std::vector< geometry_msgs::PoseStamped > &transformed_plan, int *current_goal_idx=NULL, geometry_msgs::TransformStamped *tf_plan_to_global=NULL) const
Transforms the global plan of the robot from the planner frame to the local frame (modified)...
boost::shared_ptr< T > createInstance(const std::string &lookup_name)
static double getYaw(const Quaternion &bt_q)
costmap_2d::Costmap2D * _costmap
Pointer to the 2d costmap (obtained from the costmap ros wrapper)
void updateViaPointsContainer(const std::vector< geometry_msgs::PoseStamped > &transformed_plan, double min_separation)
Update internal via-point container based on the current reference plan.
void publishGlobalPlan(const std::vector< geometry_msgs::PoseStamped > &global_plan) const
Publish a given global plan to the ros topic ../../global_plan.
ViaPointContainer _via_points
std::string getGlobalFrameID()
geometry_msgs::Twist _robot_vel
Store current robot translational and angular velocity (vx, vy, omega)
geometry_msgs::Twist _last_cmd
Store the last control command generated in computeVelocityCommands()
std::vector< geometry_msgs::PoseStamped > _global_plan
Store the current global plan.
static double getNumberFromXMLRPC(XmlRpc::XmlRpcValue &value, const std::string &full_param_name)
Get a number from the given XmlRpcValue.
static Eigen::Vector2d tfPoseToEigenVector2dTransRot(const tf::Pose &tf_vel)
Transform a tf::Pose type into a Eigen::Vector2d containing the translational and angular velocities...
void validateFootprints(double opt_inscribed_radius, double costmap_inscribed_radius, double min_obst_dist)
Validate current parameter values of the footprint for optimization, obstacle distance and the costma...
bool _goal_reached
store whether the goal is reached or not
pluginlib::ClassLoader< costmap_converter::BaseCostmapToPolygons > _costmap_converter_loader
Load costmap converter plugins at runtime.
std::vector< Eigen::Vector2d, Eigen::aligned_allocator< Eigen::Vector2d > > Point2dContainer
double _robot_circumscribed_radius
The radius of the circumscribed circle of the robot.
ObstContainer _obstacles
Obstacle vector that should be considered during local trajectory optimization.
bool include_costmap_obstacles
void doTransform(const T &data_in, T &data_out, const geometry_msgs::TransformStamped &transform)
std::mutex _via_point_mutex
Mutex that locks the via_points container (multi-threaded)
double _robot_inscribed_radius
The radius of the inscribed circle of the robot (collision possible)
double costmap_converter_rate
void customViaPointsCB(const nav_msgs::Path::ConstPtr &via_points_msg)
Callback for custom via-points.
costmap_2d::Costmap2DROS * _costmap_ros
Pointer to the costmap ros wrapper, received from the navigation stack.
geometry_msgs::TransformStamped t
double global_plan_viapoint_sep
bool pruneGlobalPlan(const tf2_ros::Buffer &tf, const geometry_msgs::PoseStamped &global_pose, std::vector< geometry_msgs::PoseStamped > &global_plan, double dist_behind_robot=1)
Prune global plan such that already passed poses are cut off.
double global_plan_prune_distance
teb_local_planner::ObstaclePtr ObstaclePtr
void initialize(ros::NodeHandle &nh, RobotDynamicsInterface::Ptr system, const std::string &map_frame)
Initializes the class and registers topics.
double costmap_obstacles_behind_robot_dist
bool setPlan(const std::vector< geometry_msgs::PoseStamped > &orig_global_plan)
Set the plan that the teb local planner is following.
int collision_check_no_poses
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
Type const & getType() const
virtual geometry_msgs::TransformStamped lookupTransform(const std::string &target_frame, const std::string &source_frame, const ros::Time &time, const ros::Duration timeout) const
ros::Subscriber _via_points_sub
Subscriber for custom via-points received via a Path msg.
static RobotFootprintModelPtr getRobotFootprintFromParamServer(const ros::NodeHandle &nh, costmap_2d::Costmap2DROS *costmap_ros=nullptr)
Get the current robot footprint/contour model.
int _no_infeasible_plans
Store how many times in a row the planner failed to find a feasible plan.
base_local_planner::OdometryHelperRos _odom_helper
Provides an interface to receive the current velocity from the robot.
bool global_plan_overwrite_orientation
PoseSE2 _robot_pose
Store current robot pose.
teb_local_planner::PointObstacle PointObstacle
PoseSE2 _robot_goal
Store current robot goal.
bool getParam(const std::string &key, std::string &s) const
EIGEN_DEVICE_FUNC SegmentReturnType head(Index n) const
bool computeVelocityCommands(geometry_msgs::Twist &cmd_vel)
Given the current position, orientation, and velocity of the robot, compute velocity commands to send...
OptimalControlProblemInterface::Ptr getOptimalControlProblem()
std::string getBaseFrameID()
EIGEN_DEVICE_FUNC const Scalar & q
std::string costmap_converter_plugin
boost::shared_ptr< costmap_converter::BaseCostmapToPolygons > _costmap_converter
Store the current costmap_converter.
bool getRobotPose(geometry_msgs::PoseStamped &global_pose) const
ros::Subscriber _custom_obst_sub
Subscriber for custom obstacles received via a ObstacleMsg.
teb_local_planner::Point2dContainer Point2dContainer
void pushBackVertex(const Eigen::Ref< const Eigen::Vector2d > &vertex)
void updateObstacleContainerWithCostmapConverter()
Update internal obstacle vector based on polygons provided by a costmap_converter plugin...
#define ROS_WARN_STREAM(args)
virtual std::string getName(const std::string &lookup_name)
teb_local_planner::PoseSE2 PoseSE2
bool hasParam(const std::string &key) const
double getYaw(const A &a)
double distance_points2d(const P1 &point1, const P2 &point2)
Calculate Euclidean distance between two 2D point datatypes.
teb_local_planner::LineObstacle LineObstacle
std::mutex _custom_obst_mutex
Mutex that locks the obstacle array (multi-threaded)
static Point2dContainer makeFootprintFromXMLRPC(XmlRpc::XmlRpcValue &footprint_xmlrpc, const std::string &full_param_name)
Set the footprint from the given XmlRpcValue.
#define ROS_INFO_STREAM(args)
static const unsigned char LETHAL_OBSTACLE
const std::string & getNamespace() const
tf2_ros::Buffer * _tf
pointer to tf buffer
corbo::TimeSeries::Ptr _u_seq
static RobotFootprintModelPtr getRobotFootprintFromCostmap2d(costmap_2d::Costmap2DROS &costmap_ros)
Get the current robot footprint/contour model.
double average_angles(const std::vector< double > &angles)
geometry_msgs::Polygon getRobotFootprintPolygon()
double normalize_theta(double theta)
normalize angle to interval [-pi, pi)
bool is_footprint_dynamic
void updateObstacleContainerWithCustomObstacles()
Update internal obstacle vector based on custom messages received via subscriber. ...
teb_local_planner::PolygonObstacle PolygonObstacle
corbo::TimeSeries::Ptr _x_seq
#define ROS_WARN_COND(cond,...)
double yaw_goal_tolerance
void convert(const A &a, B &b)
double getResolution() const
void setOdomTopic(std::string odom_topic)
bool _custom_via_points_active
Keep track whether valid via-points have been received from via_points_sub_.
~MpcLocalPlannerROS()
Destructor of the plugin.
double controller_frequency
void customObstacleCB(const costmap_converter::ObstacleArrayMsg::ConstPtr &obst_msg)
Callback for the dynamic_reconfigure node.
struct mpc_local_planner::MpcLocalPlannerROS::CostmapConverterPlugin _costmap_conv_params
void updateObstacleContainerWithCostmap()
Update internal obstacle vector based on occupied costmap cells.
ros::Time _time_last_infeasible_plan
Store at which time stamp the last infeasible plan was detected.
void getRobotVel(geometry_msgs::PoseStamped &robot_vel)
#define ROS_ERROR_STREAM(args)
double distance_points2d(const P1 &point1, const P2 &point2)
Implements both nav_core::BaseLocalPlanner and mbf_costmap_core::CostmapController abstract interface...
void setInitialPlanEstimateOrientation(bool estimate)
std::vector< geometry_msgs::Point > getRobotFootprint()
bool costmap_converter_spin_thread
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
void mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) const
double collision_check_min_resolution_angular
bool configure(ros::NodeHandle &nh, const teb_local_planner::ObstContainer &obstacles, teb_local_planner::RobotFootprintModelPtr robot_model, const std::vector< teb_local_planner::PoseSE2 > &via_points)
unsigned char getCost(unsigned int mx, unsigned int my) const
StageInequalitySE2::Ptr getInequalityConstraint()
std::shared_ptr< base_local_planner::CostmapModel > _costmap_model
std::string _robot_base_frame
Used as the base frame id of the robot.
Eigen::Isometry3d transformToEigen(const geometry_msgs::Transform &t)
virtual bool isPoseTrajectoryFeasible(base_local_planner::CostmapModel *costmap_model, const std::vector< geometry_msgs::Point > &footprint_spec, double inscribed_radius=0.0, double circumscribed_radius=0.0, double min_resolution_collision_check_angular=M_PI, int look_ahead_idx=-1)
Check whether the planned trajectory is feasible or not.
void initialize(std::string name, tf2_ros::Buffer *tf, costmap_2d::Costmap2DROS *costmap_ros)
Initializes the teb plugin.
void calculateMinAndMaxDistances(const std::vector< geometry_msgs::Point > &footprint, double &min_dist, double &max_dist)