A class adhering to the robot_actions::Action interface that moves the robot base to explore its environment. More...
#include <explore.h>
Public Member Functions | |
| void | execute () |
| Runs whenever a new goal is sent to the move_base. | |
| Explore () | |
| Constructor. | |
| void | spin () |
| virtual | ~Explore () |
| Destructor - Cleans up. | |
Private Member Functions | |
| bool | goalOnBlacklist (const geometry_msgs::PoseStamped &goal) |
| void | makePlan () |
| Make a global plan. | |
| bool | mapCallback (nav_msgs::GetMap::Request &req, nav_msgs::GetMap::Response &res) |
| Resets the costmaps to the static map outside a given window. | |
| void | publishGoal (const geometry_msgs::Pose &goal) |
| Publish a goal to the visualizer. | |
| void | publishMap () |
| publish map | |
| void | reachedGoal (const actionlib::SimpleClientGoalState &status, const move_base_msgs::MoveBaseResultConstPtr &result, geometry_msgs::PoseStamped frontier_goal) |
Private Attributes | |
| boost::mutex | client_mutex_ |
| bool | close_loops_ |
| bool | done_exploring_ |
| costmap_2d::Costmap2DROS * | explore_costmap_ros_ |
| ExploreFrontier * | explorer_ |
| std::vector < geometry_msgs::PoseStamped > | frontier_blacklist_ |
| double | gain_scale_ |
| tf::Stamped< tf::Pose > | global_pose_ |
| LoopClosure * | loop_closure_ |
| ros::Publisher | map_publisher_ |
| ros::ServiceServer | map_server_ |
| ros::Publisher | marker_array_publisher_ |
| ros::Publisher | marker_publisher_ |
| actionlib::SimpleActionClient < move_base_msgs::MoveBaseAction > | move_base_client_ |
| ros::NodeHandle | node_ |
| double | orientation_scale_ |
| navfn::NavfnROS * | planner_ |
| double | planner_frequency_ |
| double | potential_scale_ |
| geometry_msgs::PoseStamped | prev_goal_ |
| unsigned int | prev_plan_size_ |
| double | progress_timeout_ |
| std::string | robot_base_frame_ |
| tf::TransformListener | tf_ |
| double | time_since_progress_ |
| int | visualize_ |
A class adhering to the robot_actions::Action interface that moves the robot base to explore its environment.
Definition at line 55 of file explore.h.
| explore::Explore::Explore | ( | ) |
| explore::Explore::~Explore | ( | ) | [virtual] |
Destructor - Cleans up.
Definition at line 103 of file explore.cpp.
| void explore::Explore::execute | ( | ) |
Runs whenever a new goal is sent to the move_base.
| goal | The goal to pursue | |
| feedback | Feedback that the action gives to a higher-level monitor, in this case, the position of the robot |
Definition at line 315 of file explore.cpp.
| bool explore::Explore::goalOnBlacklist | ( | const geometry_msgs::PoseStamped & | goal | ) | [private] |
Definition at line 285 of file explore.cpp.
| void explore::Explore::makePlan | ( | ) | [private] |
Make a global plan.
Definition at line 204 of file explore.cpp.
| bool explore::Explore::mapCallback | ( | nav_msgs::GetMap::Request & | req, | |
| nav_msgs::GetMap::Response & | res | |||
| ) | [private] |
Resets the costmaps to the static map outside a given window.
Definition at line 117 of file explore.cpp.
| void explore::Explore::publishGoal | ( | const geometry_msgs::Pose & | goal | ) | [private] |
Publish a goal to the visualizer.
| goal | The goal to visualize |
Definition at line 185 of file explore.cpp.
| void explore::Explore::publishMap | ( | ) | [private] |
publish map
Definition at line 151 of file explore.cpp.
| void explore::Explore::reachedGoal | ( | const actionlib::SimpleClientGoalState & | status, | |
| const move_base_msgs::MoveBaseResultConstPtr & | result, | |||
| geometry_msgs::PoseStamped | frontier_goal | |||
| ) | [private] |
Definition at line 297 of file explore.cpp.
| void explore::Explore::spin | ( | ) |
Definition at line 340 of file explore.cpp.
boost::mutex explore::Explore::client_mutex_ [private] |
bool explore::Explore::close_loops_ [private] |
bool explore::Explore::done_exploring_ [private] |
costmap_2d::Costmap2DROS* explore::Explore::explore_costmap_ros_ [private] |
ExploreFrontier* explore::Explore::explorer_ [private] |
std::vector<geometry_msgs::PoseStamped> explore::Explore::frontier_blacklist_ [private] |
double explore::Explore::gain_scale_ [private] |
tf::Stamped<tf::Pose> explore::Explore::global_pose_ [private] |
LoopClosure* explore::Explore::loop_closure_ [private] |
ros::Publisher explore::Explore::map_publisher_ [private] |
ros::ServiceServer explore::Explore::map_server_ [private] |
ros::Publisher explore::Explore::marker_array_publisher_ [private] |
ros::Publisher explore::Explore::marker_publisher_ [private] |
actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> explore::Explore::move_base_client_ [private] |
ros::NodeHandle explore::Explore::node_ [private] |
double explore::Explore::orientation_scale_ [private] |
navfn::NavfnROS* explore::Explore::planner_ [private] |
double explore::Explore::planner_frequency_ [private] |
double explore::Explore::potential_scale_ [private] |
geometry_msgs::PoseStamped explore::Explore::prev_goal_ [private] |
unsigned int explore::Explore::prev_plan_size_ [private] |
double explore::Explore::progress_timeout_ [private] |
std::string explore::Explore::robot_base_frame_ [private] |
tf::TransformListener explore::Explore::tf_ [private] |
double explore::Explore::time_since_progress_ [private] |
int explore::Explore::visualize_ [private] |