open_manipulator_controller.h
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 
19 #ifndef OPEN_MANIPULATOR_CONTROLLER_H_
20 #define OPEN_MANIPULATOR_CONTROLLER_H_
21 
22 #include <boost/thread.hpp>
23 #include <unistd.h>
24 
25 #include <geometry_msgs/PoseStamped.h>
26 #include <ros/ros.h>
27 #include <sensor_msgs/JointState.h>
28 #include <std_msgs/Float64.h>
29 #include <std_msgs/String.h>
30 #include <std_msgs/Empty.h>
31 #include <trajectory_msgs/JointTrajectory.h>
32 #include <trajectory_msgs/JointTrajectoryPoint.h>
33 
35 #include "open_manipulator_msgs/SetJointPosition.h"
36 #include "open_manipulator_msgs/SetKinematicsPose.h"
37 #include "open_manipulator_msgs/SetDrawingTrajectory.h"
38 #include "open_manipulator_msgs/SetActuatorState.h"
39 #include "open_manipulator_msgs/GetJointPosition.h"
40 #include "open_manipulator_msgs/GetKinematicsPose.h"
41 #include "open_manipulator_msgs/OpenManipulatorState.h"
42 
44 {
46 {
47  public:
48  OpenManipulatorController(std::string usb_port, std::string baud_rate);
50 
51  // update
52  void publishCallback(const ros::TimerEvent&);
53  void startTimerThread();
54  static void *timerThread(void *param);
55  void process(double time);
56  double getControlPeriod(void){return control_period_;}
57 
58  private:
59  /*****************************************************************************
60  ** ROS NodeHandle
61  *****************************************************************************/
64 
65  /*****************************************************************************
66  ** ROS Parameters
67  *****************************************************************************/
70 
71  /*****************************************************************************
72  ** Variables
73  *****************************************************************************/
74  // Thread parameter
75  pthread_t timer_thread_;
76  pthread_attr_t attr_;
78 
79  // Robotis_manipulator related
81 
82  /*****************************************************************************
83  ** Init Functions
84  *****************************************************************************/
85  void initPublisher();
86  void initSubscriber();
87  void initServer();
88 
89  /*****************************************************************************
90  ** ROS Publishers, Callback Functions and Relevant Functions
91  *****************************************************************************/
93  std::vector<ros::Publisher> open_manipulator_kinematics_pose_pub_;
95  std::vector<ros::Publisher> gazebo_goal_joint_position_pub_;
96 
98  void publishKinematicsPose();
99  void publishJointStates();
100  void publishGazeboCommand();
101 
102  /*****************************************************************************
103  ** ROS Subscribers and Callback Functions
104  *****************************************************************************/
106 
107  void openManipulatorOptionCallback(const std_msgs::String::ConstPtr &msg);
108 
109  /*****************************************************************************
110  ** ROS Servers and Callback Functions
111  *****************************************************************************/
130 
131  bool goalJointSpacePathCallback(open_manipulator_msgs::SetJointPosition::Request &req,
132  open_manipulator_msgs::SetJointPosition::Response &res);
133 
134  bool goalJointSpacePathToKinematicsPoseCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
135  open_manipulator_msgs::SetKinematicsPose::Response &res);
136 
137  bool goalJointSpacePathToKinematicsPositionCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
138  open_manipulator_msgs::SetKinematicsPose::Response &res);
139 
140  bool goalJointSpacePathToKinematicsOrientationCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
141  open_manipulator_msgs::SetKinematicsPose::Response &res);
142 
143  bool goalTaskSpacePathCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
144  open_manipulator_msgs::SetKinematicsPose::Response &res);
145 
146  bool goalTaskSpacePathPositionOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
147  open_manipulator_msgs::SetKinematicsPose::Response &res);
148 
149  bool goalTaskSpacePathOrientationOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
150  open_manipulator_msgs::SetKinematicsPose::Response &res);
151 
152  bool goalJointSpacePathFromPresentCallback(open_manipulator_msgs::SetJointPosition::Request &req,
153  open_manipulator_msgs::SetJointPosition::Response &res);
154 
155  bool goalTaskSpacePathFromPresentCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
156  open_manipulator_msgs::SetKinematicsPose::Response &res);
157 
158  bool goalTaskSpacePathFromPresentPositionOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
159  open_manipulator_msgs::SetKinematicsPose::Response &res);
160 
161  bool goalTaskSpacePathFromPresentOrientationOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req,
162  open_manipulator_msgs::SetKinematicsPose::Response &res);
163 
164  bool goalToolControlCallback(open_manipulator_msgs::SetJointPosition::Request &req,
165  open_manipulator_msgs::SetJointPosition::Response &res);
166 
167  bool setActuatorStateCallback(open_manipulator_msgs::SetActuatorState::Request &req,
168  open_manipulator_msgs::SetActuatorState::Response &res);
169 
170  bool goalDrawingTrajectoryCallback(open_manipulator_msgs::SetDrawingTrajectory::Request &req,
171  open_manipulator_msgs::SetDrawingTrajectory::Response &res);
172 };
173 }
174 #endif //OPEN_MANIPULATOR_CONTROLLER_H_
bool param(const std::string &param_name, T &param_val, const T &default_val)
bool goalToolControlCallback(open_manipulator_msgs::SetJointPosition::Request &req, open_manipulator_msgs::SetJointPosition::Response &res)
bool goalTaskSpacePathOrientationOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
bool goalTaskSpacePathCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
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)
bool setActuatorStateCallback(open_manipulator_msgs::SetActuatorState::Request &req, open_manipulator_msgs::SetActuatorState::Response &res)
void openManipulatorOptionCallback(const std_msgs::String::ConstPtr &msg)
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)
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)
bool goalTaskSpacePathFromPresentPositionOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
bool goalDrawingTrajectoryCallback(open_manipulator_msgs::SetDrawingTrajectory::Request &req, open_manipulator_msgs::SetDrawingTrajectory::Response &res)
bool goalJointSpacePathToKinematicsPositionCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
bool goalJointSpacePathToKinematicsOrientationCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)


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