35 int main(
int argc,
char** argv)
46 std::string move_group_name =
"manipulator";
47 JogAPI jogger(move_group_name,
"/jog_arm_server/delta_jog_cmds");
52 geometry_msgs::PoseStamped new_pose;
53 new_pose.header.frame_id =
"world";
55 new_pose.pose.position.x = 0.4;
56 new_pose.pose.position.y = 0.23;
57 new_pose.pose.position.z = 0.4;
58 new_pose.pose.orientation.x = 0.025;
59 new_pose.pose.orientation.y = 0.247;
60 new_pose.pose.orientation.z = 0.283;
61 new_pose.pose.orientation.w = 0.926;
66 std::vector<double> speed_scale{ 0.5, 0.5, 0.5, 1.0, 1.0, 1.0 };
bool jacobianMove(geometry_msgs::PoseStamped &target_pose, const double trans_tolerance, const double rot_tolerance, const std::vector< double > &speed_scale, const ros::Duration &timeout)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
geometry_msgs::PoseStamped getCurrentPose(const std::string &end_effector_link="")
#define ROS_INFO_STREAM(args)
#define ROS_ERROR_STREAM(args)
int main(int argc, char **argv)