7#include <dynamic_reconfigure/server.h>
8#include <geometry_msgs/PoseStamped.h>
9#include <nav_core/base_local_planner.h>
11#include <tf/transform_listener.h>
12#include <tf2_ros/buffer.h>
20namespace forward_local_planner
48 virtual bool setPlan(
const std::vector<geometry_msgs::PoseStamped> &plan)
override;
58 void initialize(std::string name, tf2_ros::Buffer *tf, costmap_2d::Costmap2DROS *costmapRos);
86 void generateTrajectory(
const Eigen::Vector3f &pos,
const Eigen::Vector3f &vel,
float maxdist,
float maxangle,
float maxtime,
float dt, std::vector<Eigen::Vector3f> &outtraj);
87 Eigen::Vector3f
computeNewPositions(
const Eigen::Vector3f &pos,
const Eigen::Vector3f &vel,
double dt);
92 std::vector<geometry_msgs::PoseStamped>
plan_;
Eigen::Vector3f computeNewPositions(const Eigen::Vector3f &pos, const Eigen::Vector3f &vel, double dt)
ros::Publisher goalMarkerPublisher_
double max_angular_z_speed_
virtual bool computeVelocityCommands(geometry_msgs::Twist &cmd_vel) override
Given the current position, orientation, and velocity of the robot: compute velocity commands to send...
costmap_2d::Costmap2DROS * costmapRos_
const double alpha_offset_
void generateTrajectory(const Eigen::Vector3f &pos, const Eigen::Vector3f &vel, float maxdist, float maxangle, float maxtime, float dt, std::vector< Eigen::Vector3f > &outtraj)
rad carrot_angular_distance_
virtual ~ForwardLocalPlanner()
double yaw_goal_tolerance_
std::vector< geometry_msgs::PoseStamped > plan_
const double betta_offset_
ros::Duration waitingTimeout_
virtual bool setPlan(const std::vector< geometry_msgs::PoseStamped > &plan) override
Set the plan that the local planner is following.
virtual bool isGoalReached() override
Check if the goal pose has been achieved by the local planner.
double max_linear_x_speed_
double xy_goal_tolerance_
void publishGoalMarker(double x, double y, double phi)