rc_hand_eye_calibration_client_node.cpp
Go to the documentation of this file.
2 #include <ros/ros.h>
3 
4 int main(int argc, char **argv)
5 {
6  std::string name = "rc_hand_eye_calibration";
7  ros::init(argc, argv, name);
8 
9  ros::NodeHandle pnh("~");
10  std::string host;
11  pnh.param("host", host, host);
12 
13  if (host.empty()) {
14  ROS_FATAL("No host set! Please set the parameter 'host'!");
15  return 1;
16  }
17 
18  std::unique_ptr<CalibrationWrapper> calib_wrapper;
19 
20  try
21  {
22  // instantiate wrapper and advertise services
23  calib_wrapper.reset(new CalibrationWrapper(host, pnh));
24  }
25  catch (const std::exception &ex)
26  {
27  ROS_FATAL("Client could not be created due to an error: %s", ex.what());
28  return 1;
29  }
30 
31  ROS_INFO_STREAM("Hand eye calibration node started for host: " << host);
32 
33  // start ros node
34  ros::spin();
35 }
int main(int argc, char **argv)
#define ROS_FATAL(...)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
bool param(const std::string &param_name, T &param_val, const T &default_val) const
ROSCPP_DECL void spin()
#define ROS_INFO_STREAM(args)


rc_hand_eye_calibration_client
Author(s): Christian Emmerich
autogenerated on Wed Mar 20 2019 07:55:45