include
ftc_local_planner
transform_global_plan.h
Go to the documentation of this file.
1
18
#ifndef FTC_LOCAL_PLANNER_TRANSFORM_GLOBAL_PLAN_H_
19
#define FTC_LOCAL_PLANNER_TRANSFORM_GLOBAL_PLAN_H_
20
#include <
ros/ros.h
>
21
#include <
tf/transform_listener.h
>
22
#include <
tf/transform_datatypes.h
>
23
#include <nav_msgs/Odometry.h>
24
#include <nav_msgs/Path.h>
25
#include <geometry_msgs/PoseStamped.h>
26
#include <geometry_msgs/Twist.h>
27
#include <geometry_msgs/Point.h>
28
29
#include <string>
30
#include <cmath>
31
32
#include <
angles/angles.h
>
33
#include <
costmap_2d/costmap_2d.h
>
34
namespace
ftc_local_planner
35
{
44
bool
getXPose
(
const
tf2_ros::Buffer
&
tf
,
45
const
std::vector<geometry_msgs::PoseStamped>& global_plan,
46
const
std::string& global_frame,
47
tf::Stamped<tf::Pose>
&goal_pose,
int
plan_point);
48
};
49
#endif
transform_listener.h
tf
tf2_ros::Buffer
transform_datatypes.h
ftc_local_planner
Definition:
ftc_planner.h:39
tf::Stamped
costmap_2d.h
ros.h
angles.h
ftc_local_planner::getXPose
bool getXPose(const tf2_ros::Buffer &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.
Definition:
transform_global_plan.cpp:22
asr_ftc_local_planner
Author(s): Marek Felix
autogenerated on Mon Feb 28 2022 21:45:41