6 #ifndef YOCS_WAYPOINT_NAVI_HPP_ 7 #define YOCS_WAYPOINT_NAVI_HPP_ 12 #include <geometry_msgs/PointStamped.h> 13 #include <move_base_msgs/MoveBaseAction.h> 17 #include <yocs_msgs/NavigationControl.h> 18 #include <yocs_msgs/NavigationControlStatus.h> 19 #include <yocs_msgs/TrajectoryList.h> 20 #include <yocs_msgs/WaypointList.h> 40 void waypointsCB(
const yocs_msgs::WaypointList::ConstPtr& wps);
42 void trajectoriesCB(
const yocs_msgs::TrajectoryList::ConstPtr& trajs);
44 void navCtrlCB(
const yocs_msgs::NavigationControl::ConstPtr& nav_ctrl);
71 geometry_msgs::PoseStamped
goal_;
90 bool equals(
const geometry_msgs::PoseStamped& a,
const geometry_msgs::PoseStamped& b);
92 bool equals(
const geometry_msgs::Point& a,
const geometry_msgs::Point& b);
bool equals(const geometry_msgs::PoseStamped &a, const geometry_msgs::PoseStamped &b)
bool cancelAllGoals(double timeout=2.0)
const geometry_msgs::PoseStamped NOWHERE
void navCtrlCB(const yocs_msgs::NavigationControl::ConstPtr &nav_ctrl)
yocs_msgs::TrajectoryList traj_list_
ros::Subscriber trajectories_sub_
std::vector< geometry_msgs::PoseStamped >::iterator waypoints_it_
actionlib::SimpleActionClient< move_base_msgs::MoveBaseAction > move_base_ac_
bool idle_status_update_sent_
yocs_msgs::WaypointList wp_list_
void publishStatusUpdate(const uint8_t &status)
void trajectoriesCB(const yocs_msgs::TrajectoryList::ConstPtr &trajs)
ros::Subscriber nav_ctrl_sub_
enum yocs::WaypointsGoalNode::@1 state_
void waypointsCB(const yocs_msgs::WaypointList::ConstPtr &wps)
tf::TransformListener tf_listener_
std::vector< geometry_msgs::PoseStamped > waypoints_
geometry_msgs::PoseStamped goal_
enum yocs::WaypointsGoalNode::@0 mode_
ros::Publisher status_pub_
ros::Subscriber waypoints_sub_