open_manipulator_controller.cpp
Go to the documentation of this file.
1 /*******************************************************************************
2 * Copyright 2018 ROBOTIS CO., LTD.
3 *
4 * Licensed under the Apache License, Version 2.0 (the "License");
5 * you may not use this file except in compliance with the License.
6 * You may obtain a copy of the License at
7 *
8 * http://www.apache.org/licenses/LICENSE-2.0
9 *
10 * Unless required by applicable law or agreed to in writing, software
11 * distributed under the License is distributed on an "AS IS" BASIS,
12 * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
13 * See the License for the specific language governing permissions and
14 * limitations under the License.
15 *******************************************************************************/
16 
17 /* Authors: Darby Lim, Hye-Jong KIM, Ryan Shim, Yong-Ho Na */
18 
20 
21 using namespace open_manipulator_controller;
22 
23 OpenManipulatorController::OpenManipulatorController(std::string usb_port, std::string baud_rate)
24 : node_handle_(""),
25  priv_node_handle_("~"),
26  timer_thread_state_(false)
27 {
28  /************************************************************
29  ** Initialize ROS parameters
30  ************************************************************/
31  control_period_ = priv_node_handle_.param<double>("control_period", 0.010f);
32  using_platform_ = priv_node_handle_.param<bool>("using_platform", false);
33 
34  /************************************************************
35  ** Initialize variables
36  ************************************************************/
37  open_manipulator_.initOpenManipulator(using_platform_, usb_port, baud_rate, control_period_);
38 
39  if (using_platform_ == true) log::info("Succeeded to init " + priv_node_handle_.getNamespace());
40  else if (using_platform_ == false) log::info("Ready to simulate " + priv_node_handle_.getNamespace() + " on Gazebo");
41 
42  /************************************************************
43  ** Initialize ROS publishers, subscribers and servers
44  ************************************************************/
45  initPublisher();
47  initServer();
48 }
49 
51 {
52  timer_thread_state_ = false;
53  pthread_join(timer_thread_, NULL); // Wait for the thread associated with thread_p to complete
54  log::info("Shutdown OpenManipulator Controller");
56  ros::shutdown();
57 }
58 
60 {
64  // pthread_attr_t attr_;
65  // int error;
66  // struct sched_param param;
67  // pthread_attr_init(&attr_);
68 
69  // error = pthread_attr_setschedpolicy(&attr_, SCHED_RR);
70  // if (error != 0) log::error("pthread_attr_setschedpolicy error = ", (double)error);
71  // error = pthread_attr_setinheritsched(&attr_, PTHREAD_EXPLICIT_SCHED);
72  // if (error != 0) log::error("pthread_attr_setinheritsched error = ", (double)error);
73 
74  // memset(&param, 0, sizeof(param));
75  // param.sched_priority = 31; // RT
76  // error = pthread_attr_setschedparam(&attr_, &param);
77  // if (error != 0) log::error("pthread_attr_setschedparam error = ", (double)error);
78 
79  // if ((error = pthread_create(&this->timer_thread_, &attr_, this->timerThread, this)) != 0)
80  // {
81  // log::error("Creating timer thread failed!!", (double)error);
82  // exit(-1);
83  // }
84  // timer_thread_state_ = true;
86 
87  int error;
88  if ((error = pthread_create(&this->timer_thread_, NULL, this->timerThread, this)) != 0)
89  {
90  log::error("Creating timer thread failed!!", (double)error);
91  exit(-1);
92  }
93  timer_thread_state_ = true;
94 }
95 
97 {
99  static struct timespec next_time;
100  static struct timespec curr_time;
101 
102  clock_gettime(CLOCK_MONOTONIC, &next_time);
103 
104  while(controller->timer_thread_state_)
105  {
106  next_time.tv_sec += (next_time.tv_nsec + ((int)(controller->getControlPeriod() * 1000)) * 1000000) / 1000000000;
107  next_time.tv_nsec = (next_time.tv_nsec + ((int)(controller->getControlPeriod() * 1000)) * 1000000) % 1000000000;
108 
109  double time = next_time.tv_sec + (next_time.tv_nsec*0.000000001);
110  controller->process(time);
111 
112  clock_gettime(CLOCK_MONOTONIC, &curr_time);
114  double delta_nsec = controller->getControlPeriod() - ((next_time.tv_sec - curr_time.tv_sec) + ((double)(next_time.tv_nsec - curr_time.tv_nsec)*0.000000001));
115  //log::info("control time : ", controller->getControlPeriod() - delta_nsec);
116  if (delta_nsec > controller->getControlPeriod())
117  {
118  //log::warn("Over the control time : ", delta_nsec);
119  next_time = curr_time;
120  }
121  else
122  clock_nanosleep(CLOCK_MONOTONIC, TIMER_ABSTIME, &next_time, NULL);
124  }
125  return 0;
126 }
127 
128 /********************************************************************************
129 ** Init Functions
130 ********************************************************************************/
132 {
133  // ros message publisher
134  auto om_tools_name = open_manipulator_.getManipulator()->getAllToolComponentName();
135 
136  for (auto const& name:om_tools_name)
137  {
138  ros::Publisher pb;
139  pb = node_handle_.advertise<open_manipulator_msgs::KinematicsPose>(name + "/kinematics_pose", 10);
141  }
142  open_manipulator_states_pub_ = node_handle_.advertise<open_manipulator_msgs::OpenManipulatorState>("states", 10);
143 
144  if (using_platform_ == true)
145  {
146  open_manipulator_joint_states_pub_ = node_handle_.advertise<sensor_msgs::JointState>("joint_states", 10);
147  }
148  else
149  {
150  auto gazebo_joints_name = open_manipulator_.getManipulator()->getAllActiveJointComponentName();
151  gazebo_joints_name.reserve(gazebo_joints_name.size() + om_tools_name.size());
152  gazebo_joints_name.insert(gazebo_joints_name.end(), om_tools_name.begin(), om_tools_name.end());
153 
154  for (auto const& name:gazebo_joints_name)
155  {
156  ros::Publisher pb;
157  pb = node_handle_.advertise<std_msgs::Float64>(name + "_position/command", 10);
158  gazebo_goal_joint_position_pub_.push_back(pb);
159  }
160  }
161 }
163 {
164  // ros message subscriber
166 }
167 
169 {
174 
178 
180 
184 
188 }
189 
190 /*****************************************************************************
191 ** Callback Functions for ROS Subscribers
192 *****************************************************************************/
193 void OpenManipulatorController::openManipulatorOptionCallback(const std_msgs::String::ConstPtr &msg)
194 {
195  if (msg->data == "print_open_manipulator_setting")
197 }
198 
199 /*****************************************************************************
200 ** Callback Functions for ROS Servers
201 *****************************************************************************/
202 bool OpenManipulatorController::goalJointSpacePathCallback(open_manipulator_msgs::SetJointPosition::Request &req,
203  open_manipulator_msgs::SetJointPosition::Response &res)
204 {
205  std::vector <double> target_angle;
206 
207  for (int i = 0; i < req.joint_position.joint_name.size(); i ++)
208  target_angle.push_back(req.joint_position.position.at(i));
209 
210  if (!open_manipulator_.makeJointTrajectory(target_angle, req.path_time))
211  res.is_planned = false;
212  else
213  res.is_planned = true;
214 
215  return true;
216 }
217 
218 bool OpenManipulatorController::goalJointSpacePathToKinematicsPoseCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
219  open_manipulator_msgs::SetKinematicsPose::Response &res)
220 {
221  KinematicPose target_pose;
222  target_pose.position[0] = req.kinematics_pose.pose.position.x;
223  target_pose.position[1] = req.kinematics_pose.pose.position.y;
224  target_pose.position[2] = req.kinematics_pose.pose.position.z;
225 
226  Eigen::Quaterniond q(req.kinematics_pose.pose.orientation.w,
227  req.kinematics_pose.pose.orientation.x,
228  req.kinematics_pose.pose.orientation.y,
229  req.kinematics_pose.pose.orientation.z);
230 
231  target_pose.orientation = math::convertQuaternionToRotationMatrix(q);
232 
233  if (!open_manipulator_.makeJointTrajectory(req.end_effector_name, target_pose, req.path_time))
234  res.is_planned = false;
235  else
236  res.is_planned = true;
237 
238  return true;
239 }
240 
241 bool OpenManipulatorController::goalJointSpacePathToKinematicsPositionCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
242  open_manipulator_msgs::SetKinematicsPose::Response &res)
243 {
244  KinematicPose target_pose;
245  target_pose.position[0] = req.kinematics_pose.pose.position.x;
246  target_pose.position[1] = req.kinematics_pose.pose.position.y;
247  target_pose.position[2] = req.kinematics_pose.pose.position.z;
248 
249  if (!open_manipulator_.makeJointTrajectory(req.end_effector_name, target_pose.position, req.path_time))
250  res.is_planned = false;
251  else
252  res.is_planned = true;
253 
254  return true;
255 }
256 
257 bool OpenManipulatorController::goalJointSpacePathToKinematicsOrientationCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
258  open_manipulator_msgs::SetKinematicsPose::Response &res)
259 {
260  KinematicPose target_pose;
261 
262  Eigen::Quaterniond q(req.kinematics_pose.pose.orientation.w,
263  req.kinematics_pose.pose.orientation.x,
264  req.kinematics_pose.pose.orientation.y,
265  req.kinematics_pose.pose.orientation.z);
266 
267  target_pose.orientation = math::convertQuaternionToRotationMatrix(q);
268 
269  if (!open_manipulator_.makeJointTrajectory(req.end_effector_name, target_pose.orientation, req.path_time))
270  res.is_planned = false;
271  else
272  res.is_planned = true;
273  return true;
274 }
275 
276 bool OpenManipulatorController::goalTaskSpacePathCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
277  open_manipulator_msgs::SetKinematicsPose::Response &res)
278 {
279  KinematicPose target_pose;
280  target_pose.position[0] = req.kinematics_pose.pose.position.x;
281  target_pose.position[1] = req.kinematics_pose.pose.position.y;
282  target_pose.position[2] = req.kinematics_pose.pose.position.z;
283 
284  Eigen::Quaterniond q(req.kinematics_pose.pose.orientation.w,
285  req.kinematics_pose.pose.orientation.x,
286  req.kinematics_pose.pose.orientation.y,
287  req.kinematics_pose.pose.orientation.z);
288 
289  target_pose.orientation = math::convertQuaternionToRotationMatrix(q);
290  if (!open_manipulator_.makeTaskTrajectory(req.end_effector_name, target_pose, req.path_time))
291  res.is_planned = false;
292  else
293  res.is_planned = true;
294 
295  return true;
296 }
297 
298 bool OpenManipulatorController::goalTaskSpacePathPositionOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
299  open_manipulator_msgs::SetKinematicsPose::Response &res)
300 {
301  Eigen::Vector3d position;
302  position[0] = req.kinematics_pose.pose.position.x;
303  position[1] = req.kinematics_pose.pose.position.y;
304  position[2] = req.kinematics_pose.pose.position.z;
305 
306  if (!open_manipulator_.makeTaskTrajectory(req.end_effector_name, position, req.path_time))
307  res.is_planned = false;
308  else
309  res.is_planned = true;
310 
311  return true;
312 }
313 
314 bool OpenManipulatorController::goalTaskSpacePathOrientationOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
315  open_manipulator_msgs::SetKinematicsPose::Response &res)
316 {
317  Eigen::Quaterniond q(req.kinematics_pose.pose.orientation.w,
318  req.kinematics_pose.pose.orientation.x,
319  req.kinematics_pose.pose.orientation.y,
320  req.kinematics_pose.pose.orientation.z);
321 
322  Eigen::Matrix3d orientation = math::convertQuaternionToRotationMatrix(q);
323 
324  if (!open_manipulator_.makeTaskTrajectory(req.end_effector_name, orientation, req.path_time))
325  res.is_planned = false;
326  else
327  res.is_planned = true;
328 
329  return true;
330 }
331 
332 bool OpenManipulatorController::goalJointSpacePathFromPresentCallback(open_manipulator_msgs::SetJointPosition::Request &req,
333  open_manipulator_msgs::SetJointPosition::Response &res)
334 {
335  std::vector <double> target_angle;
336 
337  for (int i = 0; i < req.joint_position.joint_name.size(); i ++)
338  target_angle.push_back(req.joint_position.position.at(i));
339 
340  if (!open_manipulator_.makeJointTrajectoryFromPresentPosition(target_angle, req.path_time))
341  res.is_planned = false;
342  else
343  res.is_planned = true;
344 
345  return true;
346 }
347 
348 bool OpenManipulatorController::goalTaskSpacePathFromPresentCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
349  open_manipulator_msgs::SetKinematicsPose::Response &res)
350 {
351  KinematicPose target_pose;
352  target_pose.position[0] = req.kinematics_pose.pose.position.x;
353  target_pose.position[1] = req.kinematics_pose.pose.position.y;
354  target_pose.position[2] = req.kinematics_pose.pose.position.z;
355 
356  Eigen::Quaterniond q(req.kinematics_pose.pose.orientation.w,
357  req.kinematics_pose.pose.orientation.x,
358  req.kinematics_pose.pose.orientation.y,
359  req.kinematics_pose.pose.orientation.z);
360 
361  target_pose.orientation = math::convertQuaternionToRotationMatrix(q);
362 
363  if (!open_manipulator_.makeTaskTrajectoryFromPresentPose(req.planning_group, target_pose, req.path_time))
364  res.is_planned = false;
365  else
366  res.is_planned = true;
367 
368  return true;
369 }
370 
371 bool OpenManipulatorController::goalTaskSpacePathFromPresentPositionOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
372  open_manipulator_msgs::SetKinematicsPose::Response &res)
373 {
374  Eigen::Vector3d position;
375  position[0] = req.kinematics_pose.pose.position.x;
376  position[1] = req.kinematics_pose.pose.position.y;
377  position[2] = req.kinematics_pose.pose.position.z;
378 
379  if (!open_manipulator_.makeTaskTrajectoryFromPresentPose(req.planning_group, position, req.path_time))
380  res.is_planned = false;
381  else
382  res.is_planned = true;
383 
384  return true;
385 }
386 
387 bool OpenManipulatorController::goalTaskSpacePathFromPresentOrientationOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
388  open_manipulator_msgs::SetKinematicsPose::Response &res)
389 {
390  Eigen::Quaterniond q(req.kinematics_pose.pose.orientation.w,
391  req.kinematics_pose.pose.orientation.x,
392  req.kinematics_pose.pose.orientation.y,
393  req.kinematics_pose.pose.orientation.z);
394 
395  Eigen::Matrix3d orientation = math::convertQuaternionToRotationMatrix(q);
396 
397  if (!open_manipulator_.makeTaskTrajectoryFromPresentPose(req.planning_group, orientation, req.path_time))
398  res.is_planned = false;
399  else
400  res.is_planned = true;
401 
402  return true;
403 }
404 
405 bool OpenManipulatorController::goalToolControlCallback(open_manipulator_msgs::SetJointPosition::Request &req,
406  open_manipulator_msgs::SetJointPosition::Response &res)
407 {
408  for (int i = 0; i < req.joint_position.joint_name.size(); i ++)
409  {
410  if (!open_manipulator_.makeToolTrajectory(req.joint_position.joint_name.at(i), req.joint_position.position.at(i)))
411  res.is_planned = false;
412  else
413  res.is_planned = true;
414  }
415 
416  return true;
417 }
418 
419 bool OpenManipulatorController::setActuatorStateCallback(open_manipulator_msgs::SetActuatorState::Request &req,
420  open_manipulator_msgs::SetActuatorState::Response &res)
421 {
422  if (req.set_actuator_state == true) // enable actuators
423  {
424  log::println("Wait a second for actuator enable", "GREEN");
425  timer_thread_state_ = false;
426  pthread_join(timer_thread_, NULL); // Wait for the thread associated with thread_p to complete
429  }
430  else // disable actuators
431  {
432  log::println("Wait a second for actuator disable", "GREEN");
433  timer_thread_state_ = false;
434  pthread_join(timer_thread_, NULL); // Wait for the thread associated with thread_p to complete
437  }
438 
439  res.is_planned = true;
440 
441  return true;
442 }
443 
444 bool OpenManipulatorController::goalDrawingTrajectoryCallback(open_manipulator_msgs::SetDrawingTrajectory::Request &req,
445  open_manipulator_msgs::SetDrawingTrajectory::Response &res)
446 {
447  try
448  {
449  if (req.drawing_trajectory_name == "circle")
450  {
451  double draw_circle_arg[3];
452  draw_circle_arg[0] = req.param[0]; // radius (m)
453  draw_circle_arg[1] = req.param[1]; // revolution (rev)
454  draw_circle_arg[2] = req.param[2]; // start angle position (rad)
455  void* p_draw_circle_arg = &draw_circle_arg;
456 
457  if (!open_manipulator_.makeCustomTrajectory(CUSTOM_TRAJECTORY_CIRCLE, req.end_effector_name, p_draw_circle_arg, req.path_time))
458  res.is_planned = false;
459  else
460  res.is_planned = true;
461  }
462  else if (req.drawing_trajectory_name == "line")
463  {
464  TaskWaypoint draw_line_arg;
465  draw_line_arg.kinematic.position(0) = req.param[0]; // x axis (m)
466  draw_line_arg.kinematic.position(1) = req.param[1]; // y axis (m)
467  draw_line_arg.kinematic.position(2) = req.param[2]; // z axis (m)
468  void *p_draw_line_arg = &draw_line_arg;
469 
470  if (!open_manipulator_.makeCustomTrajectory(CUSTOM_TRAJECTORY_LINE, req.end_effector_name, p_draw_line_arg, req.path_time))
471  res.is_planned = false;
472  else
473  res.is_planned = true;
474  }
475  else if (req.drawing_trajectory_name == "rhombus")
476  {
477  double draw_rhombus_arg[3];
478  draw_rhombus_arg[0] = req.param[0]; // radius (m)
479  draw_rhombus_arg[1] = req.param[1]; // revolution (rev)
480  draw_rhombus_arg[2] = req.param[2]; // start angle position (rad)
481  void* p_draw_rhombus_arg = &draw_rhombus_arg;
482 
483  if (!open_manipulator_.makeCustomTrajectory(CUSTOM_TRAJECTORY_RHOMBUS, req.end_effector_name, p_draw_rhombus_arg, req.path_time))
484  res.is_planned = false;
485  else
486  res.is_planned = true;
487  }
488  else if (req.drawing_trajectory_name == "heart")
489  {
490  double draw_heart_arg[3];
491  draw_heart_arg[0] = req.param[0]; // radius (m)
492  draw_heart_arg[1] = req.param[1]; // revolution (rev)
493  draw_heart_arg[2] = req.param[2]; // start angle position (rad)
494  void* p_draw_heart_arg = &draw_heart_arg;
495 
496  if (!open_manipulator_.makeCustomTrajectory(CUSTOM_TRAJECTORY_HEART, req.end_effector_name, p_draw_heart_arg, req.path_time))
497  res.is_planned = false;
498  else
499  res.is_planned = true;
500  }
501 
502  return true;
503  }
504  catch ( ros::Exception &e )
505  {
506  log::error("Creation the custom trajectory is failed!");
507  }
508 
509  return true;
510 }
511 
512 /********************************************************************************
513 ** Callback function for process timer
514 ********************************************************************************/
516 {
518 }
519 
520 /********************************************************************************
521 ** Callback function for publish timer
522 ********************************************************************************/
524 {
525  if (using_platform_ == true) publishJointStates();
526  else publishGazeboCommand();
527 
530 }
531 
533 {
534  open_manipulator_msgs::OpenManipulatorState msg;
536  msg.open_manipulator_moving_state = msg.IS_MOVING;
537  else
538  msg.open_manipulator_moving_state = msg.STOPPED;
539 
541  msg.open_manipulator_actuator_state = msg.ACTUATOR_ENABLED;
542  else
543  msg.open_manipulator_actuator_state = msg.ACTUATOR_DISABLED;
544 
546 }
547 
549 {
550  open_manipulator_msgs::KinematicsPose msg;
551  auto om_tools_name = open_manipulator_.getManipulator()->getAllToolComponentName();
552 
553  uint8_t index = 0;
554  for (auto const& tools:om_tools_name)
555  {
557  msg.pose.position.x = pose.position[0];
558  msg.pose.position.y = pose.position[1];
559  msg.pose.position.z = pose.position[2];
560  Eigen::Quaterniond orientation = math::convertRotationMatrixToQuaternion(pose.orientation);
561  msg.pose.orientation.w = orientation.w();
562  msg.pose.orientation.x = orientation.x();
563  msg.pose.orientation.y = orientation.y();
564  msg.pose.orientation.z = orientation.z();
565 
566  open_manipulator_kinematics_pose_pub_.at(index).publish(msg);
567  index++;
568  }
569 }
570 
572 {
573  sensor_msgs::JointState msg;
574  msg.header.stamp = ros::Time::now();
575 
578 
579  auto joint_value = open_manipulator_.getAllActiveJointValue();
580  auto tool_value = open_manipulator_.getAllToolValue();
581 
582  for (uint8_t i = 0; i < joints_name.size(); i ++)
583  {
584  msg.name.push_back(joints_name.at(i));
585 
586  msg.position.push_back(joint_value.at(i).position);
587  msg.velocity.push_back(joint_value.at(i).velocity);
588  msg.effort.push_back(joint_value.at(i).effort);
589  }
590 
591  for (uint8_t i = 0; i < tool_name.size(); i ++)
592  {
593  msg.name.push_back(tool_name.at(i));
594 
595  msg.position.push_back(tool_value.at(i).position);
596  msg.velocity.push_back(0.0f);
597  msg.effort.push_back(0.0f);
598  }
600 }
601 
603 {
606 
607  for (uint8_t i = 0; i < joint_value.size(); i ++)
608  {
609  std_msgs::Float64 msg;
610  msg.data = joint_value.at(i).position;
611 
612  gazebo_goal_joint_position_pub_.at(i).publish(msg);
613  }
614 
615  for (uint8_t i = 0; i < tool_value.size(); i ++)
616  {
617  std_msgs::Float64 msg;
618  msg.data = tool_value.at(i).position;
619 
620  gazebo_goal_joint_position_pub_.at(joint_value.size() + i).publish(msg);
621  }
622 }
623 
624 /*****************************************************************************
625 ** Main
626 *****************************************************************************/
627 int main(int argc, char **argv)
628 {
629  // init
630  ros::init(argc, argv, "open_manipulator_controller");
631  ros::NodeHandle node_handle("");
632 
633  std::string usb_port = "/dev/ttyUSB0";
634  std::string baud_rate = "1000000";
635 
636  if (argc = 3)
637  {
638  usb_port = argv[1];
639  baud_rate = argv[2];
640  printf("port_name and baud_rate are set to %s, %s \n", usb_port.c_str(), baud_rate.c_str());
641  }
642  else
643  {
644  log::error("Please set '-port_name' and '-baud_rate' arguments for connected Dynamixels");
645  return 1;
646  }
647 
648  OpenManipulatorController om_controller(usb_port, baud_rate);
649 
650  // update
651  om_controller.startTimerThread();
652  ros::Timer publish_timer = node_handle.createTimer(ros::Duration(om_controller.getControlPeriod()), &OpenManipulatorController::publishCallback, &om_controller);
653  ros::Rate loop_rate(100);
654  while (ros::ok())
655  {
656  ros::spinOnce();
657  loop_rate.sleep();
658  }
659 
660  return 0;
661 }
std::vector< Name > getAllToolComponentName()
bool makeTaskTrajectoryFromPresentPose(Name tool_name, Eigen::Vector3d position_meter, double move_time, std::vector< JointValue > present_joint_value={})
bool goalToolControlCallback(open_manipulator_msgs::SetJointPosition::Request &req, open_manipulator_msgs::SetJointPosition::Response &res)
f
Timer createTimer(Rate r, Handler h, Obj o, bool oneshot=false, bool autostart=true) const
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
bool goalTaskSpacePathOrientationOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
#define CUSTOM_TRAJECTORY_CIRCLE
std::vector< JointValue > getAllActiveJointValue()
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
bool goalTaskSpacePathCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
bool makeTaskTrajectory(Name tool_name, Eigen::Vector3d goal_position, double move_time, std::vector< JointValue > present_joint_value={})
bool makeCustomTrajectory(Name trajectory_name, Name tool_name, const void *arg, double move_time, std::vector< JointValue > present_joint_value={})
bool getActuatorEnabledState(Name actuator_name)
void processOpenManipulator(double present_time)
bool makeJointTrajectory(std::vector< double > goal_joint_position, double move_time, std::vector< JointValue > present_joint_value={})
KinematicPose getKinematicPose(Name component_name)
ServiceServer advertiseService(const std::string &service, bool(T::*srv_func)(MReq &, MRes &), T *obj)
bool goalTaskSpacePathFromPresentOrientationOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
bool goalTaskSpacePathPositionOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
std::vector< JointValue > JointWaypoint
std::vector< Name > getAllActiveJointComponentName()
bool makeJointTrajectoryFromPresentPosition(std::vector< double > delta_goal_joint_position, double move_time, std::vector< JointValue > present_joint_value={})
bool setActuatorStateCallback(open_manipulator_msgs::SetActuatorState::Request &req, open_manipulator_msgs::SetActuatorState::Response &res)
bool param(const std::string &param_name, T &param_val, const T &default_val) const
void publish(const boost::shared_ptr< M > &message) const
#define CUSTOM_TRAJECTORY_HEART
void openManipulatorOptionCallback(const std_msgs::String::ConstPtr &msg)
bool makeToolTrajectory(Name tool_name, double tool_goal_position)
bool goalTaskSpacePathFromPresentCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
bool goalJointSpacePathFromPresentCallback(open_manipulator_msgs::SetJointPosition::Request &req, open_manipulator_msgs::SetJointPosition::Response &res)
OpenManipulatorController(std::string usb_port, std::string baud_rate)
ROSCPP_DECL bool ok()
bool goalJointSpacePathCallback(open_manipulator_msgs::SetJointPosition::Request &req, open_manipulator_msgs::SetJointPosition::Response &res)
bool goalJointSpacePathToKinematicsPoseCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
#define JOINT_DYNAMIXEL
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
bool goalTaskSpacePathFromPresentPositionOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
bool sleep()
bool goalDrawingTrajectoryCallback(open_manipulator_msgs::SetDrawingTrajectory::Request &req, open_manipulator_msgs::SetDrawingTrajectory::Response &res)
void initOpenManipulator(bool using_actual_robot_state, STRING usb_port="/dev/ttyUSB0", STRING baud_rate="1000000", float control_loop_time=0.010)
const std::string & getNamespace() const
void error(STRING str)
std::vector< JointValue > getAllToolValue()
bool goalJointSpacePathToKinematicsPositionCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
#define CUSTOM_TRAJECTORY_LINE
static Time now()
ROSCPP_DECL void shutdown()
#define CUSTOM_TRAJECTORY_RHOMBUS
bool goalJointSpacePathToKinematicsOrientationCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
ROSCPP_DECL void spinOnce()
int main(int argc, char **argv)


open_manipulator_controller
Author(s): Darby Lim , Hye-Jong KIM , Ryan Shim , Yong-Ho Na
autogenerated on Mon Feb 28 2022 23:02:21