19 #ifndef OPEN_MANIPULATOR_WITH_TB3_MOVEIT_BRIDGE_H 20 #define OPEN_MANIPULATOR_WITH_TB3_MOVEIT_BRIDGE_H 32 #include <moveit_msgs/DisplayTrajectory.h> 34 #include <trajectory_msgs/JointTrajectory.h> 35 #include <trajectory_msgs/JointTrajectoryPoint.h> 39 #include <std_msgs/String.h> 40 #include <std_msgs/Float64.h> 41 #include <std_msgs/Float64MultiArray.h> 42 #include <geometry_msgs/PoseStamped.h> 44 #include "open_manipulator_msgs/OpenManipulatorState.h" 46 #include "open_manipulator_msgs/GetJointPosition.h" 47 #include "open_manipulator_msgs/GetKinematicsPose.h" 49 #include "open_manipulator_msgs/SetJointPosition.h" 50 #include "open_manipulator_msgs/SetKinematicsPose.h" 91 bool calcPlannedPath(
const std::string planning_group, open_manipulator_msgs::JointPosition msg);
92 bool calcPlannedPath(
const std::string planning_group, open_manipulator_msgs::KinematicsPose msg);
97 open_manipulator_msgs::SetJointPosition::Response &res);
100 open_manipulator_msgs::SetKinematicsPose::Response &res);
103 open_manipulator_msgs::GetJointPosition::Response &res);
106 open_manipulator_msgs::GetKinematicsPose::Response &res);
moveit::planning_interface::MoveGroupInterface * move_group_
std::string planning_group_
bool getKinematicsPoseMsgCallback(open_manipulator_msgs::GetKinematicsPose::Request &req, open_manipulator_msgs::GetKinematicsPose::Response &res)
bool setJointPositionMsgCallback(open_manipulator_msgs::SetJointPosition::Request &req, open_manipulator_msgs::SetJointPosition::Response &res)
ros::ServiceServer get_kinematics_pose_server_
void controlCallback(const ros::TimerEvent &)
ros::ServiceServer set_joint_position_server_
ros::Subscriber display_planned_path_sub_
ros::ServiceServer set_kinematics_pose_server_
ros::ServiceServer get_joint_position_server_
ros::Publisher joint_trajectory_point_pub_
void displayPlannedPathMsgCallback(const moveit_msgs::DisplayTrajectory::ConstPtr &msg)
bool setKinematicsPoseMsgCallback(open_manipulator_msgs::SetKinematicsPose::Request &req, open_manipulator_msgs::SetKinematicsPose::Response &res)
bool getJointPositionMsgCallback(open_manipulator_msgs::GetJointPosition::Request &req, open_manipulator_msgs::GetJointPosition::Response &res)
bool calcPlannedPath(const std::string planning_group, open_manipulator_msgs::JointPosition msg)