25 priv_node_handle_(
"~"),
26 timer_thread_state_(false)
54 log::info(
"Shutdown OpenManipulator Controller");
90 log::error(
"Creating timer thread failed!!", (
double)error);
99 static struct timespec next_time;
100 static struct timespec curr_time;
102 clock_gettime(CLOCK_MONOTONIC, &next_time);
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;
109 double time = next_time.tv_sec + (next_time.tv_nsec*0.000000001);
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));
119 next_time = curr_time;
122 clock_nanosleep(CLOCK_MONOTONIC, TIMER_ABSTIME, &next_time, NULL);
136 for (
auto const& name:om_tools_name)
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());
154 for (
auto const& name:gazebo_joints_name)
195 if (msg->data ==
"print_open_manipulator_setting")
203 open_manipulator_msgs::SetJointPosition::Response &res)
205 std::vector <double> target_angle;
207 for (
int i = 0; i < req.joint_position.joint_name.size(); i ++)
208 target_angle.push_back(req.joint_position.position.at(i));
211 res.is_planned =
false;
213 res.is_planned =
true;
219 open_manipulator_msgs::SetKinematicsPose::Response &res)
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;
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);
231 target_pose.
orientation = math::convertQuaternionToRotationMatrix(q);
234 res.is_planned =
false;
236 res.is_planned =
true;
242 open_manipulator_msgs::SetKinematicsPose::Response &res)
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;
250 res.is_planned =
false;
252 res.is_planned =
true;
258 open_manipulator_msgs::SetKinematicsPose::Response &res)
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);
267 target_pose.
orientation = math::convertQuaternionToRotationMatrix(q);
270 res.is_planned =
false;
272 res.is_planned =
true;
277 open_manipulator_msgs::SetKinematicsPose::Response &res)
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;
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);
289 target_pose.
orientation = math::convertQuaternionToRotationMatrix(q);
291 res.is_planned =
false;
293 res.is_planned =
true;
299 open_manipulator_msgs::SetKinematicsPose::Response &res)
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;
307 res.is_planned =
false;
309 res.is_planned =
true;
315 open_manipulator_msgs::SetKinematicsPose::Response &res)
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);
322 Eigen::Matrix3d orientation = math::convertQuaternionToRotationMatrix(q);
325 res.is_planned =
false;
327 res.is_planned =
true;
333 open_manipulator_msgs::SetJointPosition::Response &res)
335 std::vector <double> target_angle;
337 for (
int i = 0; i < req.joint_position.joint_name.size(); i ++)
338 target_angle.push_back(req.joint_position.position.at(i));
341 res.is_planned =
false;
343 res.is_planned =
true;
349 open_manipulator_msgs::SetKinematicsPose::Response &res)
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;
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);
361 target_pose.
orientation = math::convertQuaternionToRotationMatrix(q);
364 res.is_planned =
false;
366 res.is_planned =
true;
372 open_manipulator_msgs::SetKinematicsPose::Response &res)
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;
380 res.is_planned =
false;
382 res.is_planned =
true;
388 open_manipulator_msgs::SetKinematicsPose::Response &res)
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);
395 Eigen::Matrix3d orientation = math::convertQuaternionToRotationMatrix(q);
398 res.is_planned =
false;
400 res.is_planned =
true;
406 open_manipulator_msgs::SetJointPosition::Response &res)
408 for (
int i = 0; i < req.joint_position.joint_name.size(); i ++)
411 res.is_planned =
false;
413 res.is_planned =
true;
420 open_manipulator_msgs::SetActuatorState::Response &res)
422 if (req.set_actuator_state ==
true)
424 log::println(
"Wait a second for actuator enable",
"GREEN");
432 log::println(
"Wait a second for actuator disable",
"GREEN");
439 res.is_planned =
true;
445 open_manipulator_msgs::SetDrawingTrajectory::Response &res)
449 if (req.drawing_trajectory_name ==
"circle")
451 double draw_circle_arg[3];
452 draw_circle_arg[0] = req.param[0];
453 draw_circle_arg[1] = req.param[1];
454 draw_circle_arg[2] = req.param[2];
455 void* p_draw_circle_arg = &draw_circle_arg;
458 res.is_planned =
false;
460 res.is_planned =
true;
462 else if (req.drawing_trajectory_name ==
"line")
468 void *p_draw_line_arg = &draw_line_arg;
471 res.is_planned =
false;
473 res.is_planned =
true;
475 else if (req.drawing_trajectory_name ==
"rhombus")
477 double draw_rhombus_arg[3];
478 draw_rhombus_arg[0] = req.param[0];
479 draw_rhombus_arg[1] = req.param[1];
480 draw_rhombus_arg[2] = req.param[2];
481 void* p_draw_rhombus_arg = &draw_rhombus_arg;
484 res.is_planned =
false;
486 res.is_planned =
true;
488 else if (req.drawing_trajectory_name ==
"heart")
490 double draw_heart_arg[3];
491 draw_heart_arg[0] = req.param[0];
492 draw_heart_arg[1] = req.param[1];
493 draw_heart_arg[2] = req.param[2];
494 void* p_draw_heart_arg = &draw_heart_arg;
497 res.is_planned =
false;
499 res.is_planned =
true;
506 log::error(
"Creation the custom trajectory is failed!");
534 open_manipulator_msgs::OpenManipulatorState msg;
536 msg.open_manipulator_moving_state = msg.IS_MOVING;
538 msg.open_manipulator_moving_state = msg.STOPPED;
541 msg.open_manipulator_actuator_state = msg.ACTUATOR_ENABLED;
543 msg.open_manipulator_actuator_state = msg.ACTUATOR_DISABLED;
550 open_manipulator_msgs::KinematicsPose msg;
554 for (
auto const& tools:om_tools_name)
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();
573 sensor_msgs::JointState msg;
582 for (uint8_t i = 0; i < joints_name.size(); i ++)
584 msg.name.push_back(joints_name.at(i));
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);
591 for (uint8_t i = 0; i < tool_name.size(); i ++)
593 msg.name.push_back(tool_name.at(i));
595 msg.position.push_back(tool_value.at(i).position);
596 msg.velocity.push_back(0.0
f);
597 msg.effort.push_back(0.0
f);
607 for (uint8_t i = 0; i < joint_value.size(); i ++)
609 std_msgs::Float64 msg;
610 msg.data = joint_value.at(i).position;
615 for (uint8_t i = 0; i < tool_value.size(); i ++)
617 std_msgs::Float64 msg;
618 msg.data = tool_value.at(i).position;
627 int main(
int argc,
char **argv)
630 ros::init(argc, argv,
"open_manipulator_controller");
633 std::string usb_port =
"/dev/ttyUSB0";
634 std::string baud_rate =
"1000000";
640 printf(
"port_name and baud_rate are set to %s, %s \n", usb_port.c_str(), baud_rate.c_str());
644 log::error(
"Please set '-port_name' and '-baud_rate' arguments for connected Dynamixels");
ros::Subscriber open_manipulator_option_sub_
std::vector< Name > getAllToolComponentName()
ros::ServiceServer goal_task_space_path_orientation_only_server_
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)
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)
std::vector< ros::Publisher > gazebo_goal_joint_position_pub_
void process(double time)
#define CUSTOM_TRAJECTORY_CIRCLE
ros::ServiceServer goal_joint_space_path_server_
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)
static void * timerThread(void *param)
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)
ros::ServiceServer goal_joint_space_path_from_present_server_
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)
ros::ServiceServer goal_joint_space_path_to_kinematics_orientation_server_
void publishJointStates()
ros::ServiceServer goal_drawing_trajectory_server_
bool goalTaskSpacePathPositionOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
std::vector< JointValue > JointWaypoint
ros::ServiceServer goal_task_space_path_position_only_server_
std::vector< Name > getAllActiveJointComponentName()
bool makeJointTrajectoryFromPresentPosition(std::vector< double > delta_goal_joint_position, double move_time, std::vector< JointValue > present_joint_value={})
ros::ServiceServer set_actuator_state_server_
bool setActuatorStateCallback(open_manipulator_msgs::SetActuatorState::Request &req, open_manipulator_msgs::SetActuatorState::Response &res)
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
void publish(const boost::shared_ptr< M > &message) const
void publishGazeboCommand()
#define CUSTOM_TRAJECTORY_HEART
void openManipulatorOptionCallback(const std_msgs::String::ConstPtr &msg)
ros::NodeHandle node_handle_
ros::ServiceServer goal_task_space_path_from_present_server_
bool makeToolTrajectory(Name tool_name, double tool_goal_position)
bool goalTaskSpacePathFromPresentCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
ros::ServiceServer goal_joint_space_path_to_kinematics_position_server_
bool goalJointSpacePathFromPresentCallback(open_manipulator_msgs::SetJointPosition::Request &req, open_manipulator_msgs::SetJointPosition::Response &res)
OpenManipulatorController(std::string usb_port, std::string baud_rate)
bool goalJointSpacePathCallback(open_manipulator_msgs::SetJointPosition::Request &req, open_manipulator_msgs::SetJointPosition::Response &res)
void printManipulatorSetting()
bool goalJointSpacePathToKinematicsPoseCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
Manipulator * getManipulator()
ros::ServiceServer goal_task_space_path_server_
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
ros::NodeHandle priv_node_handle_
bool goalTaskSpacePathFromPresentPositionOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
void publishCallback(const ros::TimerEvent &)
void disableAllActuator()
ros::Publisher open_manipulator_states_pub_
~OpenManipulatorController()
ros::ServiceServer goal_task_space_path_from_present_position_only_server_
OpenManipulator open_manipulator_
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
ros::ServiceServer goal_tool_control_server_
ros::ServiceServer goal_joint_space_path_to_kinematics_pose_server_
std::vector< JointValue > getAllToolValue()
bool goalJointSpacePathToKinematicsPositionCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
#define CUSTOM_TRAJECTORY_LINE
ros::Publisher open_manipulator_joint_states_pub_
ROSCPP_DECL void shutdown()
#define CUSTOM_TRAJECTORY_RHOMBUS
void publishOpenManipulatorStates()
double getControlPeriod(void)
bool goalJointSpacePathToKinematicsOrientationCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
std::vector< ros::Publisher > open_manipulator_kinematics_pose_pub_
ros::ServiceServer goal_task_space_path_from_present_orientation_only_server_
ROSCPP_DECL void spinOnce()
Eigen::Matrix3d orientation
int main(int argc, char **argv)
void publishKinematicsPose()