Public Member Functions | Protected Attributes
dwb_plugins::SimpleGoalChecker Class Reference

Goal Checker plugin that only checks the position difference. More...

#include <simple_goal_checker.h>

Inheritance diagram for dwb_plugins::SimpleGoalChecker:
Inheritance graph
[legend]

List of all members.

Public Member Functions

void initialize (const ros::NodeHandle &nh) override
bool isGoalReached (const geometry_msgs::Pose2D &query_pose, const geometry_msgs::Pose2D &goal_pose, const nav_2d_msgs::Twist2D &velocity) override
void reset () override
 SimpleGoalChecker ()

Protected Attributes

bool check_xy_
bool stateful_
double xy_goal_tolerance_
double xy_goal_tolerance_sq_
double yaw_goal_tolerance_

Detailed Description

Goal Checker plugin that only checks the position difference.

This class can be stateful if the stateful parameter is set to true (which it is by default). This means that the goal checker will not check if the xy position matches again once it is found to be true.

Definition at line 51 of file simple_goal_checker.h.


Constructor & Destructor Documentation

Definition at line 42 of file simple_goal_checker.cpp.


Member Function Documentation

void dwb_plugins::SimpleGoalChecker::initialize ( const ros::NodeHandle nh) [override, virtual]

Implements dwb_local_planner::GoalChecker.

Reimplemented in dwb_plugins::StoppedGoalChecker.

Definition at line 47 of file simple_goal_checker.cpp.

bool dwb_plugins::SimpleGoalChecker::isGoalReached ( const geometry_msgs::Pose2D &  query_pose,
const geometry_msgs::Pose2D &  goal_pose,
const nav_2d_msgs::Twist2D &  velocity 
) [override, virtual]

Implements dwb_local_planner::GoalChecker.

Reimplemented in dwb_plugins::StoppedGoalChecker.

Definition at line 60 of file simple_goal_checker.cpp.

void dwb_plugins::SimpleGoalChecker::reset ( ) [override, virtual]

Reimplemented from dwb_local_planner::GoalChecker.

Definition at line 55 of file simple_goal_checker.cpp.


Member Data Documentation

Definition at line 62 of file simple_goal_checker.h.

Definition at line 62 of file simple_goal_checker.h.

Definition at line 61 of file simple_goal_checker.h.

Definition at line 65 of file simple_goal_checker.h.

Definition at line 61 of file simple_goal_checker.h.


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


dwb_plugins
Author(s):
autogenerated on Wed Jun 26 2019 20:09:40