#include <ros/ros.h>#include <tf/transform_listener.h>#include <tf/transform_datatypes.h>#include <nav_msgs/Odometry.h>#include <nav_msgs/Path.h>#include <geometry_msgs/PoseStamped.h>#include <geometry_msgs/Twist.h>#include <geometry_msgs/Point.h>#include <string>#include <cmath>#include <angles/angles.h>#include <costmap_2d/costmap_2d.h>

Go to the source code of this file.
Namespaces | |
| namespace | ftc_local_planner |
Functions | |
| bool | ftc_local_planner::getXPose (const tf::TransformListener &tf, const std::vector< geometry_msgs::PoseStamped > &global_plan, const std::string &global_frame, tf::Stamped< tf::Pose > &goal_pose, int plan_point) |
| Returns X pose in plan. | |