Public Member Functions | List of all members
goal_passer::GoalPasser Class Reference

#include <goal_passer.h>

Inheritance diagram for goal_passer::GoalPasser:
Inheritance graph
[legend]

Public Member Functions

 GoalPasser ()
 
void initialize (std::string name, costmap_2d::Costmap2DROS *costmap_ros)
 
bool makePlan (const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, std::vector< geometry_msgs::PoseStamped > &plan)
 
- Public Member Functions inherited from nav_core::BaseGlobalPlanner
virtual bool makePlan (const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, std::vector< geometry_msgs::PoseStamped > &plan, double &cost)
 
virtual ~BaseGlobalPlanner ()
 

Additional Inherited Members

- Protected Member Functions inherited from nav_core::BaseGlobalPlanner
 BaseGlobalPlanner ()
 

Detailed Description

Definition at line 44 of file goal_passer.h.

Constructor & Destructor Documentation

goal_passer::GoalPasser::GoalPasser ( )
inline

Definition at line 46 of file goal_passer.h.

Member Function Documentation

void goal_passer::GoalPasser::initialize ( std::string  name,
costmap_2d::Costmap2DROS costmap_ros 
)
inlinevirtual

Implements nav_core::BaseGlobalPlanner.

Definition at line 47 of file goal_passer.h.

bool goal_passer::GoalPasser::makePlan ( const geometry_msgs::PoseStamped &  start,
const geometry_msgs::PoseStamped &  goal,
std::vector< geometry_msgs::PoseStamped > &  plan 
)
virtual

Implements nav_core::BaseGlobalPlanner.

Definition at line 44 of file goal_passer.cpp.


The documentation for this class was generated from the following files:


goal_passer
Author(s): Eitan Marder-Eppstein
autogenerated on Tue Apr 2 2019 02:34:42