#include <ftc_local_planner/transform_global_plan.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. |