3 #include <move_base_to_manip/desired_poseAction.h> 5 #include "visualization_msgs/Marker.h" 8 int main(
int argc,
char **argv)
15 ROS_INFO(
"[provide_target] Waiting for action server to start.");
18 ROS_INFO(
"Action server started, sending goal.");
19 geometry_msgs::PoseStamped goal_pose;
20 goal_pose.header.frame_id =
"base_link";
22 move_base_to_manip::desired_poseGoal goal;
23 goal.desired_pose = goal_pose;
bool waitForServer(const ros::Duration &timeout=ros::Duration(0, 0)) const
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
void sendGoal(const Goal &goal, SimpleDoneCallback done_cb=SimpleDoneCallback(), SimpleActiveCallback active_cb=SimpleActiveCallback(), SimpleFeedbackCallback feedback_cb=SimpleFeedbackCallback())
int main(int argc, char **argv)