Public Member Functions | Private Member Functions | Private Attributes | List of all members
frontier_exploration::FrontierExplorationClient Class Reference

Client for FrontierExplorationServer that receives control points from rviz, and creates boundary polygon for frontier exploration. More...

Public Member Functions

 FrontierExplorationClient ()
 Constructor for the client. More...
 

Private Member Functions

void pointCb (const geometry_msgs::PointStampedConstPtr &point)
 Build boundary polygon from points received through rviz gui. More...
 
void vizPubCb ()
 Publish markers for visualization of points for boundary polygon. More...
 

Private Attributes

geometry_msgs::PolygonStamped input_
 
ros::NodeHandle nh_
 
ros::Subscriber point_
 
ros::Publisher point_viz_pub_
 
ros::WallTimer point_viz_timer_
 
ros::NodeHandle private_nh_
 
bool waiting_for_center_
 

Detailed Description

Client for FrontierExplorationServer that receives control points from rviz, and creates boundary polygon for frontier exploration.

Definition at line 31 of file explore_client.cpp.

Constructor & Destructor Documentation

frontier_exploration::FrontierExplorationClient::FrontierExplorationClient ( )
inline

Constructor for the client.

Definition at line 149 of file explore_client.cpp.

Member Function Documentation

void frontier_exploration::FrontierExplorationClient::pointCb ( const geometry_msgs::PointStampedConstPtr &  point)
inlineprivate

Build boundary polygon from points received through rviz gui.

Parameters
pointReceived point from rviz

Definition at line 92 of file explore_client.cpp.

void frontier_exploration::FrontierExplorationClient::vizPubCb ( )
inlineprivate

Publish markers for visualization of points for boundary polygon.

Definition at line 48 of file explore_client.cpp.

Member Data Documentation

geometry_msgs::PolygonStamped frontier_exploration::FrontierExplorationClient::input_
private

Definition at line 41 of file explore_client.cpp.

ros::NodeHandle frontier_exploration::FrontierExplorationClient::nh_
private

Definition at line 35 of file explore_client.cpp.

ros::Subscriber frontier_exploration::FrontierExplorationClient::point_
private

Definition at line 38 of file explore_client.cpp.

ros::Publisher frontier_exploration::FrontierExplorationClient::point_viz_pub_
private

Definition at line 39 of file explore_client.cpp.

ros::WallTimer frontier_exploration::FrontierExplorationClient::point_viz_timer_
private

Definition at line 40 of file explore_client.cpp.

ros::NodeHandle frontier_exploration::FrontierExplorationClient::private_nh_
private

Definition at line 36 of file explore_client.cpp.

bool frontier_exploration::FrontierExplorationClient::waiting_for_center_
private

Definition at line 43 of file explore_client.cpp.


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


frontier_exploration
Author(s): Paul Bovbel
autogenerated on Mon Jun 10 2019 13:25:00