Public Member Functions | Public Attributes
keyNavSafety Class Reference

safety checks for keyboard navigation More...

#include <keyNavSafety.h>

List of all members.

Public Member Functions

void baseCommandCallback (const geometry_msgs::Twist &requestedCommand)
void costCallback (const youbot_overhead_localization::CostmapCost &newCost)
 keyNavSafety ()
void localizationCallback (const youbot_overhead_localization::Pose2d &pose)

Public Attributes

ros::Publisher baseCommandPublisher
ros::Subscriber baseCommandSubscriber
ros::ServiceClient costClient
ros::Subscriber costSubscriber
youbot_overhead_localization::CostmapCost currentCost
time_t lastStopCmdTime
bool localizationInitialized
ros::Subscriber localizationSubscriber
geometry_msgs::Twist moveCommand
bool moveInitialized
ros::NodeHandle n
youbot_overhead_localization::Pose2d robotPose
bool stopCommandFound
int timeBetweenStopCmds

Detailed Description

safety checks for keyboard navigation

This class uses costs from the costmap generated for path planning to determine the safety of commands from the keyboard navigation. If the robot is in a dangerous area, the speed is calculated accordingly to prevent damage to the robot or to the environment.

Definition at line 26 of file keyNavSafety.h.


Constructor & Destructor Documentation

Constructor

This file contains the definition of the keyNavSafety class, which provides checks to make sure the robot does not damage anything while driving freely.

Author:
David Kent

Definition at line 10 of file keyNavSafety.cpp.


Member Function Documentation

void keyNavSafety::baseCommandCallback ( const geometry_msgs::Twist &  requestedCommand)

Check a base command for safety and modify it if necessary, then pass it on to the base as a movement command

Parameters:
requestedCommandthe requested move command for the robot base

Definition at line 107 of file keyNavSafety.cpp.

Update the current cost based on new map information

Parameters:
newCostupdated cost information

Definition at line 35 of file keyNavSafety.cpp.

Update the robot base localization

Parameters:
posethe robot base pose

Definition at line 124 of file keyNavSafety.cpp.


Member Data Documentation

Definition at line 31 of file keyNavSafety.h.

Definition at line 32 of file keyNavSafety.h.

Definition at line 35 of file keyNavSafety.h.

Definition at line 33 of file keyNavSafety.h.

Definition at line 38 of file keyNavSafety.h.

Definition at line 51 of file keyNavSafety.h.

Definition at line 47 of file keyNavSafety.h.

Definition at line 34 of file keyNavSafety.h.

geometry_msgs::Twist keyNavSafety::moveCommand

Definition at line 41 of file keyNavSafety.h.

Definition at line 46 of file keyNavSafety.h.

Definition at line 30 of file keyNavSafety.h.

Definition at line 44 of file keyNavSafety.h.

Definition at line 50 of file keyNavSafety.h.

Definition at line 52 of file keyNavSafety.h.


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


youbot_overhead_localization
Author(s): David Kent
autogenerated on Thu Jan 2 2014 12:14:20