goal_passer::GoalPasser Class Reference

#include <goal_passer.h>

List of all members.

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)

Private Attributes

costmap_2d::Costmap2DROS * costmap_ros_
geometry_msgs::PoseStamped last_goal_

Detailed Description

Definition at line 41 of file goal_passer.h.


Constructor & Destructor Documentation

goal_passer::GoalPasser::GoalPasser (  )  [inline]

Definition at line 42 of file goal_passer.h.


Member Function Documentation

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

Definition at line 40 of file goal_passer.cpp.

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

Definition at line 45 of file goal_passer.cpp.


Member Data Documentation

costmap_2d::Costmap2DROS* goal_passer::GoalPasser::costmap_ros_ [private]

Definition at line 47 of file goal_passer.h.

geometry_msgs::PoseStamped goal_passer::GoalPasser::last_goal_ [private]

Definition at line 48 of file goal_passer.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables


goal_passer
Author(s): Eitan Marder-Eppstein
autogenerated on Fri Jan 11 09:58:24 2013