19 #ifndef OPEN_MANIPULATOR_CONTROLLER_H_ 20 #define OPEN_MANIPULATOR_CONTROLLER_H_ 22 #include <boost/thread.hpp> 25 #include <geometry_msgs/PoseStamped.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> 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" 132 open_manipulator_msgs::SetJointPosition::Response &res);
135 open_manipulator_msgs::SetKinematicsPose::Response &res);
138 open_manipulator_msgs::SetKinematicsPose::Response &res);
141 open_manipulator_msgs::SetKinematicsPose::Response &res);
144 open_manipulator_msgs::SetKinematicsPose::Response &res);
147 open_manipulator_msgs::SetKinematicsPose::Response &res);
150 open_manipulator_msgs::SetKinematicsPose::Response &res);
153 open_manipulator_msgs::SetJointPosition::Response &res);
156 open_manipulator_msgs::SetKinematicsPose::Response &res);
159 open_manipulator_msgs::SetKinematicsPose::Response &res);
162 open_manipulator_msgs::SetKinematicsPose::Response &res);
165 open_manipulator_msgs::SetJointPosition::Response &res);
168 open_manipulator_msgs::SetActuatorState::Response &res);
171 open_manipulator_msgs::SetDrawingTrajectory::Response &res);
174 #endif //OPEN_MANIPULATOR_CONTROLLER_H_ ros::Subscriber open_manipulator_option_sub_
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val)
ros::ServiceServer goal_task_space_path_orientation_only_server_
bool goalToolControlCallback(open_manipulator_msgs::SetJointPosition::Request &req, open_manipulator_msgs::SetJointPosition::Response &res)
ros::ServiceServer get_kinematics_pose_server_
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)
ros::ServiceServer goal_joint_space_path_server_
bool goalTaskSpacePathCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
static void * timerThread(void *param)
ros::ServiceServer goal_joint_space_path_from_present_server_
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)
ros::ServiceServer goal_task_space_path_position_only_server_
ros::ServiceServer set_actuator_state_server_
bool setActuatorStateCallback(open_manipulator_msgs::SetActuatorState::Request &req, open_manipulator_msgs::SetActuatorState::Response &res)
void publishGazeboCommand()
void openManipulatorOptionCallback(const std_msgs::String::ConstPtr &msg)
ros::NodeHandle node_handle_
ros::ServiceServer goal_task_space_path_from_present_server_
bool goalTaskSpacePathFromPresentCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
ros::ServiceServer set_kinematics_pose_server_
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)
bool goalJointSpacePathToKinematicsPoseCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
ros::ServiceServer goal_task_space_path_server_
ros::NodeHandle priv_node_handle_
bool goalTaskSpacePathFromPresentPositionOnlyCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
ros::ServiceServer get_joint_position_server_
void publishCallback(const ros::TimerEvent &)
ros::Publisher open_manipulator_states_pub_
~OpenManipulatorController()
ros::ServiceServer goal_task_space_path_from_present_position_only_server_
OpenManipulator open_manipulator_
ros::ServiceServer set_joint_position_server_
bool goalDrawingTrajectoryCallback(open_manipulator_msgs::SetDrawingTrajectory::Request &req, open_manipulator_msgs::SetDrawingTrajectory::Response &res)
ros::ServiceServer goal_tool_control_server_
ros::ServiceServer goal_joint_space_path_to_kinematics_pose_server_
bool goalJointSpacePathToKinematicsPositionCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
ros::Publisher open_manipulator_joint_states_pub_
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_
void publishKinematicsPose()