Public Member Functions | Private Member Functions | Private Attributes
RandomWalk Class Reference

List of all members.

Public Member Functions

 RandomWalk ()
 ~RandomWalk ()

Private Member Functions

void cellsCallback (const nav_msgs::GridCells::ConstPtr &msg)
bool checkCell (int goal_cell_x, int goal_cell_y)
bool checkGoal (move_base_msgs::MoveBaseGoal *goal)
void goalActiveCallback ()
void goalDoneCallback (const actionlib::SimpleClientGoalState &state, const move_base_msgs::MoveBaseResultConstPtr &result)
void goalFeedbackCallback (const move_base_msgs::MoveBaseFeedbackConstPtr &feedback)
void inflatedCallback (const nav_msgs::GridCells::ConstPtr &msg)
void mapCallback (const nav_msgs::OccupancyGrid::ConstPtr &msg)
void obstaclesCallback (const nav_msgs::GridCells::ConstPtr &msg)
void odomCallback (const boost::shared_ptr< const nav_msgs::Odometry > &msg)
void setGoal ()

Private Attributes

MoveBaseClient ac_
 Move Base Action Server.
nav_msgs::GridCells cells_
 Data structure that holds the visited cells.
ros::Subscriber cells_sub_
 Visited cells topic subscriber.
nav_msgs::GridCells inflated_
 Data structure that holds the inflated obstacle cells.
ros::Subscriber inflated_sub_
 Inflated obstacles subscriber.
double inflation_radius_
 Inflation radius from the nav stack.
nav_msgs::OccupancyGrid map_
 Map.
int map_known_cells_
 Number of known cells on the map.
ros::Subscriber map_sub_
 Map subscriber.
ros::NodeHandle n_
 Node handler.
nav_msgs::GridCells obstacles_
 Data structure that holds the obstacle cells.
ros::Subscriber obstacles_sub_
 Obstacles sunscriber.
message_filters::Subscriber
< nav_msgs::Odometry > 
odom_sub_
 Odometry topic subscriber.
geometry_msgs::PoseStamped robot_pose_
 Robot pose on the global frame referential.
ros::Time start_time_
tf::TransformListener tf_
tf::MessageFilter
< nav_msgs::Odometry > * 
tf_filter_

Detailed Description

Definition at line 58 of file random_walk.cpp.


Constructor & Destructor Documentation

Definition at line 122 of file random_walk.cpp.

Definition at line 161 of file random_walk.cpp.


Member Function Documentation

void RandomWalk::cellsCallback ( const nav_msgs::GridCells::ConstPtr &  msg) [private]

Definition at line 323 of file random_walk.cpp.

bool RandomWalk::checkCell ( int  goal_cell_x,
int  goal_cell_y 
) [private]

Definition at line 224 of file random_walk.cpp.

bool RandomWalk::checkGoal ( move_base_msgs::MoveBaseGoal *  goal) [private]

Definition at line 208 of file random_walk.cpp.

void RandomWalk::goalActiveCallback ( ) [private]

Definition at line 329 of file random_walk.cpp.

void RandomWalk::goalDoneCallback ( const actionlib::SimpleClientGoalState state,
const move_base_msgs::MoveBaseResultConstPtr &  result 
) [private]

Definition at line 314 of file random_walk.cpp.

void RandomWalk::goalFeedbackCallback ( const move_base_msgs::MoveBaseFeedbackConstPtr &  feedback) [private]

Definition at line 334 of file random_walk.cpp.

void RandomWalk::inflatedCallback ( const nav_msgs::GridCells::ConstPtr &  msg) [private]

Definition at line 308 of file random_walk.cpp.

void RandomWalk::mapCallback ( const nav_msgs::OccupancyGrid::ConstPtr &  msg) [private]

Definition at line 260 of file random_walk.cpp.

void RandomWalk::obstaclesCallback ( const nav_msgs::GridCells::ConstPtr &  msg) [private]

Definition at line 302 of file random_walk.cpp.

void RandomWalk::odomCallback ( const boost::shared_ptr< const nav_msgs::Odometry > &  msg) [private]

Definition at line 279 of file random_walk.cpp.

void RandomWalk::setGoal ( ) [private]

Definition at line 167 of file random_walk.cpp.


Member Data Documentation

Move Base Action Server.

Definition at line 100 of file random_walk.cpp.

nav_msgs::GridCells RandomWalk::cells_ [private]

Data structure that holds the visited cells.

Definition at line 94 of file random_walk.cpp.

Visited cells topic subscriber.

Definition at line 86 of file random_walk.cpp.

nav_msgs::GridCells RandomWalk::inflated_ [private]

Data structure that holds the inflated obstacle cells.

Definition at line 68 of file random_walk.cpp.

Inflated obstacles subscriber.

Definition at line 84 of file random_walk.cpp.

Inflation radius from the nav stack.

Definition at line 103 of file random_walk.cpp.

nav_msgs::OccupancyGrid RandomWalk::map_ [private]

Map.

Definition at line 71 of file random_walk.cpp.

Number of known cells on the map.

Definition at line 97 of file random_walk.cpp.

Map subscriber.

Definition at line 80 of file random_walk.cpp.

Node handler.

Definition at line 77 of file random_walk.cpp.

nav_msgs::GridCells RandomWalk::obstacles_ [private]

Data structure that holds the obstacle cells.

Definition at line 66 of file random_walk.cpp.

Obstacles sunscriber.

Definition at line 82 of file random_walk.cpp.

message_filters::Subscriber<nav_msgs::Odometry> RandomWalk::odom_sub_ [private]

Odometry topic subscriber.

Definition at line 89 of file random_walk.cpp.

geometry_msgs::PoseStamped RandomWalk::robot_pose_ [private]

Robot pose on the global frame referential.

Definition at line 74 of file random_walk.cpp.

Definition at line 105 of file random_walk.cpp.

Definition at line 90 of file random_walk.cpp.

tf::MessageFilter<nav_msgs::Odometry>* RandomWalk::tf_filter_ [private]

Definition at line 91 of file random_walk.cpp.


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


random_walk
Author(s): Gonçalo Cabrita
autogenerated on Mon Jan 6 2014 11:28:41