11 : nh_(n), basic_move_(n),
12 as_navi_(nh_, SemanticNavigatorDefaultParam::
AS_NAVI, false),
13 ac_move_base_(nh_, SemanticNavigatorDefaultParam::
AC_MOVE_BASE, true)
43 loginfo(
"Wait for waypoint lists");
79 logwarn(
"Navigation Preemption Requested");
void processNavigation(yocs_msgs::NavigateToGoal::ConstPtr goal)
boost::shared_ptr< const Goal > acceptNewGoal()
yocs_msgs::WaypointList waypointlist_
bool waitForServer(const ros::Duration &timeout=ros::Duration(0, 0)) const
BasicMoveController basic_move_
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
bool navigation_in_progress_
std::string global_frame_
const std::string AS_NAVI
const std::string SUB_WAYPOINTLIST
void setPreempted(const Result &result=Result(), const std::string &text=std::string(""))
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
std::string sub_waypointlist_topic_
actionlib::SimpleActionClient< move_base_msgs::MoveBaseAction > ac_move_base_
void registerPreemptCallback(boost::function< void()> cb)
void processWaypointList(const yocs_msgs::WaypointList::ConstPtr &msg)
actionlib::SimpleActionServer< yocs_msgs::NavigateToAction > as_navi_
virtual ~SemanticNavigator()
void loginfo(const std::string &msg)
boost::thread order_process_thread_
SemanticNavigator(ros::NodeHandle &n)
ros::Subscriber sub_waypointlist_
void logwarn(const std::string &msg)
void registerGoalCallback(boost::function< void()> cb)
void processPreemptNavigateTo()
ROSCPP_DECL void spinOnce()
const std::string AC_MOVE_BASE
void processNavigateToGoal()
void terminateNavigation(bool success, const std::string message)