provide_target.cpp
Go to the documentation of this file.
1 
3 #include <move_base_to_manip/desired_poseAction.h>
4 #include "ros/ros.h"
5 #include "visualization_msgs/Marker.h"
6 
7 
8 int main(int argc, char **argv)
9 {
10 
11  ros::init(argc, argv, "provide_target");
12 
14 
15  ROS_INFO("[provide_target] Waiting for action server to start.");
16  ac.waitForServer();
17 
18  ROS_INFO("Action server started, sending goal.");
19  geometry_msgs::PoseStamped goal_pose;
20  goal_pose.header.frame_id = "base_link";
21 
22  move_base_to_manip::desired_poseGoal goal;
23  goal.desired_pose = goal_pose;
24  ac.sendGoal(goal);
25 
26  return 0;
27 }
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)
#define ROS_INFO(...)
void sendGoal(const Goal &goal, SimpleDoneCallback done_cb=SimpleDoneCallback(), SimpleActiveCallback active_cb=SimpleActiveCallback(), SimpleFeedbackCallback feedback_cb=SimpleFeedbackCallback())
int main(int argc, char **argv)


move_base_to_manip
Author(s): Andy Zelenak, Andy Zelenak
autogenerated on Sat Jul 18 2020 03:48:17