Skip to content

Commit

Permalink
readded suturo_resources
Browse files Browse the repository at this point in the history
  • Loading branch information
MideDay committed Dec 1, 2023
1 parent 6ca982d commit ac9b6ee
Show file tree
Hide file tree
Showing 3 changed files with 15 additions and 12 deletions.
6 changes: 6 additions & 0 deletions .github/workflows/reusable_robot_ci.yml
Original file line number Diff line number Diff line change
Expand Up @@ -99,6 +99,12 @@ jobs:
path: 'ros_ws/src/iai_maps'
repository: code-iai/iai_maps
ref: master
- name: Checkout suturo_resources
uses: actions/checkout@v3
with:
path: 'ros_ws/src/suturo_resources'
repository: SUTURO/suturo_resources
ref: robocup
# install robots -------------------------------------------------------------------------------------------------
- if: ${{ inputs.robot == 'hsr' }}
name: Checkout hsr_description
Expand Down
18 changes: 8 additions & 10 deletions src/giskardpy/goals/suturo.py
Original file line number Diff line number Diff line change
@@ -1,20 +1,20 @@
import os
from copy import deepcopy
from enum import Enum
from pprint import pprint
from typing import Optional, List, Dict
from typing import Optional, Dict

import actionlib
import numpy as np
import rospy
import os
from control_msgs.msg import FollowJointTrajectoryGoal, FollowJointTrajectoryAction
from geometry_msgs.msg import PoseStamped, PointStamped, Vector3, Vector3Stamped, QuaternionStamped, Quaternion

if 'GITHUB_WORKFLOW' not in os.environ:
from tmc_control_msgs.msg import GripperApplyEffortGoal, GripperApplyEffortAction
from trajectory_msgs.msg import JointTrajectoryPoint

import giskardpy.utils.tfwrapper as tf
from giskardpy import casadi_wrapper as w, identifier
from giskardpy import casadi_wrapper as w
from giskardpy.goals.align_planes import AlignPlanes
from giskardpy.goals.cartesian_goals import CartesianPosition, CartesianOrientation
from giskardpy.goals.goal import Goal, WEIGHT_ABOVE_CA, ForceSensorGoal, NonMotionGoal
Expand All @@ -23,11 +23,9 @@
from giskardpy.qp.constraint import EqualityConstraint
from giskardpy.utils.logging import loginfo, logwarn
from giskardpy.utils.math import inverse_frame
import math as m

if 'GITHUB_WORKFLOW' not in os.environ:
from manipulation_msgs.msg import ContextAction, ContextFromAbove, ContextNeatly, ContextObjectType, ContextObjectShape, \
ContextAlignVertical
from manipulation_msgs.msg import ContextAction, ContextFromAbove, ContextNeatly, ContextObjectType, ContextObjectShape, \
ContextAlignVertical


class ContextTypes(Enum):
Expand Down Expand Up @@ -358,6 +356,7 @@ def __init__(self,
velocity=self.velocity,
weight=self.weight,
suffix=self.suffix))

def make_constraints(self):
pass

Expand Down Expand Up @@ -1142,7 +1141,6 @@ def __init__(self,
target_speed: float = 1,
period_length: float = 1.0,
suffix: str = ''):

"""
Rotate a joint continuously around a center. The execution time and speed is variable.
Expand Down Expand Up @@ -1305,7 +1303,7 @@ def set_gripper_joint_position(self, position):
:return: error_code of FollowJointTrajectoryResult
"""
# pos = max(min(1.239, position), -0.105)
goal = None # PositionCmd()
goal = None # PositionCmd()
goal.pos = position
goal.speed = 0.0
goal.force = 100
Expand Down
3 changes: 1 addition & 2 deletions src/giskardpy/tree/behaviors/ros_msg_to_goal.py
Original file line number Diff line number Diff line change
Expand Up @@ -17,8 +17,7 @@
from giskardpy.goals.align_planes import AlignPlanes
from giskardpy.goals.collision_avoidance import SelfCollisionAvoidance, ExternalCollisionAvoidance
from giskardpy.goals.goal import Goal
if 'GITHUB_WORKFLOW' not in os.environ:
from giskardpy.goals.suturo import SequenceGoal
from giskardpy.goals.suturo import SequenceGoal
from giskardpy.my_types import PrefixName
from giskardpy.tree.behaviors.get_goal import GetGoal
from giskardpy.utils.logging import loginfo
Expand Down

0 comments on commit ac9b6ee

Please sign in to comment.