From 60996fe8617884c833cda29415e79bcd4203013a Mon Sep 17 00:00:00 2001 From: hello-binit <64861565+hello-binit@users.noreply.github.com> Date: Wed, 17 Jun 2020 17:42:20 -0400 Subject: [PATCH] Cleaned command groups imports --- stretch_core/nodes/command_groups.py | 23 ----------------------- 1 file changed, 23 deletions(-) diff --git a/stretch_core/nodes/command_groups.py b/stretch_core/nodes/command_groups.py index 6c4fe8c..0fc6835 100644 --- a/stretch_core/nodes/command_groups.py +++ b/stretch_core/nodes/command_groups.py @@ -1,30 +1,7 @@ #! /usr/bin/env python from __future__ import print_function -import yaml import numpy as np -import threading -import stretch_body.robot as rb -from stretch_body.hello_utils import ThreadServiceExit - -import tf2_ros -import tf_conversions - -import rospy -from geometry_msgs.msg import Quaternion -from geometry_msgs.msg import Twist -from geometry_msgs.msg import TransformStamped - -import actionlib -from control_msgs.msg import FollowJointTrajectoryAction -from control_msgs.msg import FollowJointTrajectoryResult - -from std_srvs.srv import Trigger, TriggerResponse - -from nav_msgs.msg import Odometry -from sensor_msgs.msg import JointState, Imu, MagneticField -from std_msgs.msg import Header - import hello_helpers.hello_misc as hm from hello_helpers.gripper_conversion import GripperConversion