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

Goal Checker plugin that checks the position difference and velocity. More...

#include <stopped_goal_checker.h>

Inheritance diagram for dwb_plugins::StoppedGoalChecker:
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
 StoppedGoalChecker ()

Protected Attributes

double rot_stopped_velocity_
double trans_stopped_velocity_

Detailed Description

Goal Checker plugin that checks the position difference and velocity.

Definition at line 48 of file stopped_goal_checker.h.


Constructor & Destructor Documentation

Definition at line 41 of file stopped_goal_checker.cpp.


Member Function Documentation

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

Reimplemented from dwb_plugins::SimpleGoalChecker.

Definition at line 46 of file stopped_goal_checker.cpp.

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

Reimplemented from dwb_plugins::SimpleGoalChecker.

Definition at line 53 of file stopped_goal_checker.cpp.


Member Data Documentation

Definition at line 57 of file stopped_goal_checker.h.

Definition at line 57 of file stopped_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