38 #include <navfn/MakeNavPlan.h> 39 #include <boost/shared_ptr.hpp> 47 using rm::PoseStamped;
58 bool makePlanService(MakeNavPlan::Request& req, MakeNavPlan::Response& resp);
70 vector<PoseStamped> path;
72 req.start.header.frame_id =
"map";
73 req.goal.header.frame_id =
"map";
74 bool success =
makePlan(req.start, req.goal, path);
75 resp.plan_found = success;
84 geometry_msgs::PoseStamped global_pose;
86 vector<PoseStamped> path;
102 int main (
int argc,
char** argv)
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
ros::ServiceServer make_plan_service_
NavfnWithCostmap(string name, Costmap2DROS *cmap)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
Provides a ROS wrapper for the navfn planner which runs a fast, interpolated navigation function on a...
ServiceServer advertiseService(const std::string &service, bool(T::*srv_func)(MReq &, MRes &), T *obj)
bool makePlan(const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, std::vector< geometry_msgs::PoseStamped > &plan)
Given a goal pose in the world, compute a plan.
int main(int argc, char **argv)
bool getRobotPose(geometry_msgs::PoseStamped &global_pose) const
void poseCallback(const rm::PoseStamped::ConstPtr &goal)
ros::Subscriber pose_sub_
bool makePlanService(MakeNavPlan::Request &req, MakeNavPlan::Response &resp)