|
bool | cancel () |
|
| MOCK_METHOD6 (makePlan, uint32_t(const PoseStamped &, const PoseStamped &, double, std::vector< PoseStamped > &, double &, std::string &)) |
|
virtual uint32_t | makePlan (const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, double tolerance, std::vector< geometry_msgs::PoseStamped > &plan, double &cost, std::string &message)=0 |
|
virtual | ~AbstractPlanner () |
|
Definition at line 27 of file test/planner_action.cpp.
◆ cancel()
bool MockPlanner::cancel |
( |
| ) |
|
|
inlinevirtual |
◆ MOCK_METHOD6()
MockPlanner::MOCK_METHOD6 |
( |
makePlan |
, |
|
|
uint32_t(const PoseStamped &, const PoseStamped &, double, std::vector< PoseStamped > &, double &, std::string &) |
|
|
) |
| |
The documentation for this struct was generated from the following file: