Python rospy.get_name() Examples
The following are 30
code examples of rospy.get_name().
You can vote up the ones you like or vote down the ones you don't like,
and go to the original project or source file by following the links above each example.
You may also want to check out all available functions/classes of the module
rospy
, or try the search function
.
Example #1
Source File: qsr_prob_rep_ros_server.py From strands_qsr_lib with MIT License | 6 votes |
def __init__(self, name): """ :param name: The name of the node """ rospy.logdebug( "[" + rospy.get_name() + "]: " + "Starting " ) self._lib = ProbRepLib() self.services = {} for namespace, services in ServiceManager.available_services.items(): # Automatically creating a service for all the entries in 'qsrrep_lib.rep_io.available_services' # Passing the key of the dict entry to the service to identify the right function to call for i, service in enumerate(services): # The outer lambda function creates a new scope for the inner lambda function # This is necessary to preserve the value of k, otherwise it will have the same value for all services # x will be substituded by the service request rospy.logdebug( "[" + rospy.get_name() + "]: " + "Creating service: ["+namespace+"]["+service+"]" ) self.services[service] = rospy.Service("~"+namespace+"/"+service, QSRProbRep, (lambda a,b: lambda x: self.callback(x, a, b))(namespace,service)) rospy.logdebug( "[" + rospy.get_name() + "]: " + "Created" ) rospy.logdebug( "[" + rospy.get_name() + "]: " + "Done" )
Example #2
Source File: wheel_loopback.py From differential-drive with GNU General Public License v3.0 | 6 votes |
def __init__(self): ############################################### rospy.init_node("wheel_loopback"); self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) self.rate = rospy.get_param("~rate", 200) self.timeout_secs = rospy.get_param("~timeout_secs", 0.5) self.ticks_meter = float(rospy.get_param('~ticks_meter', 50)) self.velocity_scale = float(rospy.get_param('~velocity_scale', 255)) self.latest_motor = 0 self.wheel = 0 rospy.Subscriber('motor', Int16, self.motor_callback) self.pub_wheel = rospy.Publisher('wheel', Int16, queue_size=10) ###############################################
Example #3
Source File: gripper_action_server.py From AI-Robot-Challenge-Lab with MIT License | 6 votes |
def __init__(self): self._ns = "/robot/gripper_action_server" if demo_constants.is_real_robot(): self._gripper = PSGGripper() # intera_interface.Gripper() else: self._gripper = intera_interface.Gripper() # Action Server self._server = actionlib.SimpleActionServer( self._ns, GripperCommandAction, execute_cb=self._on_gripper_action, auto_start=False) self._action_name = rospy.get_name() self._server.start() self._gripper.set_dead_zone("0.021") # Action Feedback/Result self.feedback_msg = GripperCommandFeedback() self.result_msg = GripperCommandResult() # Initialize Parameters self._timeout = 5.0
Example #4
Source File: phoxi_sensor.py From perception with Apache License 2.0 | 6 votes |
def start(self): """Start the sensor. """ if rospy.get_name() == '/unnamed': raise ValueError('PhoXi sensor must be run inside a ros node!') # Connect to the cameras if not self._connect_to_sensor(): self._running = False return False # Set up subscribers for camera data self._color_im_sub = rospy.Subscriber('/phoxi_camera/texture', ImageMessage, self._color_im_callback) self._depth_im_sub = rospy.Subscriber('/phoxi_camera/depth_map', ImageMessage, self._depth_im_callback) self._normal_map_sub = rospy.Subscriber('/phoxi_camera/normal_map', ImageMessage, self._normal_map_callback) self._running = True return True
Example #5
Source File: wheel_loopback.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def __init__(self): ############################################### rospy.init_node("wheel_loopback"); self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) self.rate = rospy.get_param("~rate", 200) self.timeout_secs = rospy.get_param("~timeout_secs", 0.5) self.ticks_meter = float(rospy.get_param('~ticks_meter', 50)) self.velocity_scale = float(rospy.get_param('~velocity_scale', 255)) self.latest_motor = 0 self.wheel = 0 rospy.Subscriber('motor', Int16, self.motor_callback) self.pub_wheel = rospy.Publisher('wheel', Int16,queue_size=10) ###############################################
Example #6
Source File: wheel_loopback.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def __init__(self): ############################################### rospy.init_node("wheel_loopback"); self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) self.rate = rospy.get_param("~rate", 200) self.timeout_secs = rospy.get_param("~timeout_secs", 0.5) self.ticks_meter = float(rospy.get_param('~ticks_meter', 50)) self.velocity_scale = float(rospy.get_param('~velocity_scale', 255)) self.latest_motor = 0 self.wheel = 0 rospy.Subscriber('motor', Int16, self.motor_callback) self.pub_wheel = rospy.Publisher('wheel', Int16,queue_size=10) ###############################################
Example #7
Source File: twist_to_motors.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def __init__(self): ############################################################# rospy.init_node("twist_to_motors") nodename = rospy.get_name() rospy.loginfo("%s started" % nodename) self.w = rospy.get_param("~base_width", 0.2) self.pub_lmotor = rospy.Publisher('lwheel_vtarget', Float32,queue_size=10) self.pub_rmotor = rospy.Publisher('rwheel_vtarget', Float32,queue_size=10) rospy.Subscriber('cmd_vel_mux/input/teleop', Twist, self.twistCallback) self.rate = rospy.get_param("~rate", 50) self.timeout_ticks = rospy.get_param("~timeout_ticks", 2) self.left = 0 self.right = 0 #############################################################
Example #8
Source File: twist_to_motors.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def __init__(self): ############################################################# rospy.init_node("twist_to_motors") nodename = rospy.get_name() rospy.loginfo("%s started" % nodename) self.w = rospy.get_param("~base_width", 0.2) self.pub_lmotor = rospy.Publisher('lwheel_vtarget', Float32,queue_size=10) self.pub_rmotor = rospy.Publisher('rwheel_vtarget', Float32,queue_size=10) rospy.Subscriber('cmd_vel_mux/input/teleop', Twist, self.twistCallback) self.rate = rospy.get_param("~rate", 50) self.timeout_ticks = rospy.get_param("~timeout_ticks", 2) self.left = 0 self.right = 0 #############################################################
Example #9
Source File: weight_sensor.py From perception with Apache License 2.0 | 5 votes |
def start(self): """Start the sensor. """ if rospy.get_name() == '/unnamed': raise ValueError('Weight sensor must be run inside a ros node!') self._weight_subscriber = rospy.Subscriber('weight_sensor/weights', Float32MultiArray, self._weights_callback) self._running = True
Example #10
Source File: qsrlib_ros_client.py From strands_qsr_lib with MIT License | 5 votes |
def __init__(self, service_node_name="qsr_lib"): """Constructor. :param service_node_name: Node name of the service. :type service_node_name: str """ self.service_topic_names = {"request": service_node_name+"/request"} """dict: Topic names of the services.""" rospy.logdebug( "[" + rospy.get_name() + "]: " + "Waiting for service '" + self.service_topic_names["request"] + "' to come up") rospy.wait_for_service(self.service_topic_names["request"]) rospy.logdebug( "[" + rospy.get_name() + "]: " + "done")
Example #11
Source File: twist_to_motors.py From differential-drive with GNU General Public License v3.0 | 5 votes |
def __init__(self): ############################################################# rospy.init_node("twist_to_motors") nodename = rospy.get_name() rospy.loginfo("%s started" % nodename) self.w = rospy.get_param("~base_width", 0.2) self.pub_lmotor = rospy.Publisher('lwheel_vtarget', Float32, queue_size=10) self.pub_rmotor = rospy.Publisher('rwheel_vtarget', Float32, queue_size=10) rospy.Subscriber('twist', Twist, self.twistCallback) self.rate = rospy.get_param("~rate", 50) self.timeout_ticks = rospy.get_param("~timeout_ticks", 2) self.left = 0 self.right = 0 #############################################################
Example #12
Source File: twist_to_motors.py From Learning-Robotics-using-Python-Second-Edition with MIT License | 5 votes |
def __init__(self): ############################################################# rospy.init_node("twist_to_motors") nodename = rospy.get_name() rospy.loginfo("%s started" % nodename) self.w = rospy.get_param("~base_width", 0.2) self.pub_lmotor = rospy.Publisher('lwheel_vtarget', Float32,queue_size=10) self.pub_rmotor = rospy.Publisher('rwheel_vtarget', Float32,queue_size=10) rospy.Subscriber('cmd_vel', Twist, self.twistCallback) self.rate = rospy.get_param("~rate", 50) self.timeout_ticks = rospy.get_param("~timeout_ticks", 2) self.left = 0 self.right = 0 #############################################################
Example #13
Source File: twist_to_motors.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def __init__(self): ############################################################# rospy.init_node("twist_to_motors") nodename = rospy.get_name() rospy.loginfo("%s started" % nodename) self.w = rospy.get_param("~base_width", 0.2) self.pub_lmotor = rospy.Publisher('lwheel_vtarget', Float32,queue_size=10) self.pub_rmotor = rospy.Publisher('rwheel_vtarget', Float32,queue_size=10) rospy.Subscriber('cmd_vel_mux/input/teleop', Twist, self.twistCallback) self.rate = rospy.get_param("~rate", 50) self.timeout_ticks = rospy.get_param("~timeout_ticks", 2) self.left = 0 self.right = 0 #############################################################
Example #14
Source File: twist_to_motors.py From Learning-Robotics-using-Python-Second-Edition with MIT License | 5 votes |
def __init__(self): ############################################################# rospy.init_node("twist_to_motors") nodename = rospy.get_name() rospy.loginfo("%s started" % nodename) self.w = rospy.get_param("~base_width", 0.2) self.pub_lmotor = rospy.Publisher('lwheel_vtarget', Float32,queue_size=10) self.pub_rmotor = rospy.Publisher('rwheel_vtarget', Float32,queue_size=10) rospy.Subscriber('cmd_vel', Twist, self.twistCallback) self.rate = rospy.get_param("~rate", 50) self.timeout_ticks = rospy.get_param("~timeout_ticks", 2) self.left = 0 self.right = 0 #############################################################
Example #15
Source File: joint_trajectory_action.py From intera_sdk with Apache License 2.0 | 4 votes |
def __init__(self, limb, reconfig_server, rate=100.0, mode='position_w_id', interpolation='minjerk'): self._dyn = reconfig_server self._ns = 'robot/limb/' + limb self._fjt_ns = self._ns + '/follow_joint_trajectory' self._server = actionlib.SimpleActionServer( self._fjt_ns, FollowJointTrajectoryAction, execute_cb=self._on_trajectory_action, auto_start=False) self._action_name = rospy.get_name() self._limb = intera_interface.Limb(limb, synchronous_pub=True) self._enable = intera_interface.RobotEnable() self._name = limb self._interpolation = interpolation self._cuff = intera_interface.Cuff(limb=limb) # Verify joint control mode self._mode = mode if (self._mode != 'position' and self._mode != 'position_w_id' and self._mode != 'velocity'): rospy.logerr("%s: Action Server Creation Failed - " "Provided Invalid Joint Control Mode '%s' (Options: " "'position_w_id', 'position', 'velocity')" % (self._action_name, self._mode,)) return self._server.start() self._alive = True # Action Feedback/Result self._fdbk = FollowJointTrajectoryFeedback() self._result = FollowJointTrajectoryResult() # Controller parameters from arguments, messages, and dynamic # reconfigure self._control_rate = rate # Hz self._control_joints = [] self._pid_gains = {'kp': dict(), 'ki': dict(), 'kd': dict()} self._goal_time = 0.0 self._stopped_velocity = 0.0 self._goal_error = dict() self._path_thresh = dict() # Create our PID controllers self._pid = dict() for joint in self._limb.joint_names(): self._pid[joint] = intera_control.PID() # Create our spline coefficients self._coeff = [None] * len(self._limb.joint_names()) # Set joint state publishing to specified control rate self._pub_rate = rospy.Publisher( '/robot/joint_state_publish_rate', UInt16, queue_size=10) self._pub_rate.publish(self._control_rate)
Example #16
Source File: diff_tf.py From ROS-Programming-Building-Powerful-Robots with MIT License | 4 votes |
def __init__(self): ############################################################################# rospy.init_node("diff_tf") self.nodename = rospy.get_name() rospy.loginfo("-I- %s started" % self.nodename) #### parameters ####### self.rate = rospy.get_param('~rate',10.0) # the rate at which to publish the transform self.ticks_meter = float(rospy.get_param('ticks_meter', 50)) # The number of wheel encoder ticks per meter of travel self.base_width = float(rospy.get_param('~base_width', 0.3)) # The wheel base width in meters self.base_frame_id = rospy.get_param('~base_frame_id','base_footprint') # the name of the base frame of the robot self.odom_frame_id = rospy.get_param('~odom_frame_id', 'odom') # the name of the odometry reference frame self.encoder_min = rospy.get_param('encoder_min', -2147483648) self.encoder_max = rospy.get_param('encoder_max', 2147483648) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.t_delta = rospy.Duration(1.0/self.rate) self.t_next = rospy.Time.now() + self.t_delta # internal data self.enc_left = None # wheel encoder readings self.enc_right = None self.left = 0 # actual values coming back from robot self.right = 0 self.lmult = 0 self.rmult = 0 self.prev_lencoder = 0 self.prev_rencoder = 0 self.x = 0 # position in xy plane self.y = 0 self.th = 0 self.dx = 0 # speeds in x/rotation self.dr = 0 self.then = rospy.Time.now() # subscriptions rospy.Subscriber("lwheel", Int64, self.lwheelCallback) rospy.Subscriber("rwheel", Int64, self.rwheelCallback) self.odomPub = rospy.Publisher("odom", Odometry,queue_size=10) self.odomBroadcaster = TransformBroadcaster() #############################################################################
Example #17
Source File: diff_tf.py From Learning-Robotics-using-Python-Second-Edition with MIT License | 4 votes |
def __init__(self): ############################################################################# rospy.init_node("diff_tf") self.nodename = rospy.get_name() rospy.loginfo("-I- %s started" % self.nodename) #### parameters ####### self.rate = rospy.get_param('~rate',10.0) # the rate at which to publish the transform self.ticks_meter = float(rospy.get_param('ticks_meter', 50)) # The number of wheel encoder ticks per meter of travel self.base_width = float(rospy.get_param('~base_width', 0.3)) # The wheel base width in meters self.base_frame_id = rospy.get_param('~base_frame_id','base_footprint') # the name of the base frame of the robot self.odom_frame_id = rospy.get_param('~odom_frame_id', 'odom') # the name of the odometry reference frame self.encoder_min = rospy.get_param('encoder_min', -2147483648) self.encoder_max = rospy.get_param('encoder_max', 2147483648) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.t_delta = rospy.Duration(1.0/self.rate) self.t_next = rospy.Time.now() + self.t_delta # internal data self.enc_left = None # wheel encoder readings self.enc_right = None self.left = 0 # actual values coming back from robot self.right = 0 self.lmult = 0 self.rmult = 0 self.prev_lencoder = 0 self.prev_rencoder = 0 self.x = 0 # position in xy plane self.y = 0 self.th = 0 self.dx = 0 # speeds in x/rotation self.dr = 0 self.then = rospy.Time.now() # subscriptions rospy.Subscriber("lwheel", Int64, self.lwheelCallback) rospy.Subscriber("rwheel", Int64, self.rwheelCallback) self.odomPub = rospy.Publisher("odom", Odometry,queue_size=10) self.odomBroadcaster = TransformBroadcaster() #############################################################################
Example #18
Source File: pid_velocity.py From Learning-Robotics-using-Python-Second-Edition with MIT License | 4 votes |
def __init__(self): ##################################################### rospy.init_node("pid_velocity") self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) ### initialize variables self.target = 0 self.motor = 0 self.vel = 0 self.integral = 0 self.error = 0 self.derivative = 0 self.previous_error = 0 self.wheel_prev = 0 self.wheel_latest = 0 self.then = rospy.Time.now() self.wheel_mult = 0 self.prev_encoder = 0 ### get parameters #### self.Kp = rospy.get_param('~Kp',10) self.Ki = rospy.get_param('~Ki',10) self.Kd = rospy.get_param('~Kd',0.001) self.out_min = rospy.get_param('~out_min',-255) self.out_max = rospy.get_param('~out_max',255) self.rate = rospy.get_param('~rate',30) self.rolling_pts = rospy.get_param('~rolling_pts',2) self.timeout_ticks = rospy.get_param('~timeout_ticks',4) self.ticks_per_meter = rospy.get_param('ticks_meter', 14860) self.vel_threshold = rospy.get_param('~vel_threshold', 0.001) self.encoder_min = rospy.get_param('encoder_min', -2147483648) self.encoder_max = rospy.get_param('encoder_max', 2147483648) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.prev_vel = [0.0] * self.rolling_pts self.wheel_latest = 0.0 self.prev_pid_time = rospy.Time.now() rospy.logdebug("%s got Kp:%0.3f Ki:%0.3f Kd:%0.3f tpm:%0.3f" % (self.nodename, self.Kp, self.Ki, self.Kd, self.ticks_per_meter)) #### subscribers/publishers rospy.Subscriber("wheel", Int64, self.wheelCallback) rospy.Subscriber("wheel_vtarget", Float32, self.targetCallback) self.pub_motor = rospy.Publisher('motor_cmd',Float32,queue_size=10) self.pub_vel = rospy.Publisher('wheel_vel', Float32,queue_size=10) #####################################################
Example #19
Source File: diff_tf.py From Learning-Robotics-using-Python-Second-Edition with MIT License | 4 votes |
def __init__(self): ############################################################################# rospy.init_node("diff_tf") self.nodename = rospy.get_name() rospy.loginfo("-I- %s started" % self.nodename) #### parameters ####### self.rate = rospy.get_param('~rate',10.0) # the rate at which to publish the transform self.ticks_meter = float(rospy.get_param('ticks_meter', 50)) # The number of wheel encoder ticks per meter of travel self.base_width = float(rospy.get_param('~base_width', 0.3)) # The wheel base width in meters self.base_frame_id = rospy.get_param('~base_frame_id','base_footprint') # the name of the base frame of the robot self.odom_frame_id = rospy.get_param('~odom_frame_id', 'odom') # the name of the odometry reference frame self.encoder_min = rospy.get_param('encoder_min', -2147483648) self.encoder_max = rospy.get_param('encoder_max', 2147483648) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.t_delta = rospy.Duration(1.0/self.rate) self.t_next = rospy.Time.now() + self.t_delta # internal data self.enc_left = None # wheel encoder readings self.enc_right = None self.left = 0 # actual values coming back from robot self.right = 0 self.lmult = 0 self.rmult = 0 self.prev_lencoder = 0 self.prev_rencoder = 0 self.x = 0 # position in xy plane self.y = 0 self.th = 0 self.dx = 0 # speeds in x/rotation self.dr = 0 self.then = rospy.Time.now() # subscriptions rospy.Subscriber("lwheel", Int64, self.lwheelCallback) rospy.Subscriber("rwheel", Int64, self.rwheelCallback) self.odomPub = rospy.Publisher("odom", Odometry,queue_size=10) self.odomBroadcaster = TransformBroadcaster() #############################################################################
Example #20
Source File: nao_speech.py From nao_robot with BSD 3-Clause "New" or "Revised" License | 4 votes |
def __init__( self, moduleName ): # ROS Initialisation NaoqiNode.__init__(self, Constants.NODE_NAME ) # NAOQi Module initialization self.moduleName = moduleName # Causes ALBroker to fill in ip and find a unused port self.ip = "" self.port = 0 self.init_almodule() # Used for speech with feedback mode only self.speech_with_feedback_flag = False # State variables self.conf = None # Get Audio proxies # Speech-recognition wrapper will be lazily initialized self.srw = None # Subscription to the Proxy events self.subscribe() # Start reconfigure server self.reconf_server = ReConfServer(NodeConfig, self.reconfigure) # Client for receiving the new information self.reconf_client = dynamic_reconfigure.client.Client(rospy.get_name()) #Subscribe to speech topic self.sub = rospy.Subscriber("speech", String, self.say ) # Advertise word recognise topic self.pub = rospy.Publisher("word_recognized", WordRecognized ) # Register ROS services self.start_srv = rospy.Service( "start_recognition", Empty, self.start ) self.stop_srv = rospy.Service( "stop_recognition", Empty, self.stop ) # Actionlib server for altering the speech recognition vocabulary self.setSpeechVocabularyServer = actionlib.SimpleActionServer("speech_vocabulary_action", SetSpeechVocabularyAction, execute_cb=self.executeSpeechVocabularyAction, auto_start=False) # Actionlib server for having speech with feedback self.speechWithFeedbackServer = actionlib.SimpleActionServer("speech_action", SpeechWithFeedbackAction, execute_cb=self.executeSpeechWithFeedbackAction, auto_start=False) # Start both actionlib servers self.setSpeechVocabularyServer.start() self.speechWithFeedbackServer.start()
Example #21
Source File: nao_speech.py From nao_robot with BSD 3-Clause "New" or "Revised" License | 4 votes |
def __init__(self, ip, port, publisher, config): # Get a (unique) name for naoqi module which is based on the node name # and is a valid Python identifier (will be useful later) self.naoqi_name = Util.to_naoqi_name( rospy.get_name() ) #Start ALBroker (needed by ALModule) self.broker = ALBroker(self.naoqi_name + "_broker", "0.0.0.0", # listen to anyone 0, # find a free port and use it ip, # parent broker IP port ) # parent broker port #Init superclass ALModule ALModule.__init__( self, self.naoqi_name ) # Start naoqi proxies self.memory = ALProxy("ALMemory") self.proxy = ALProxy("ALSpeechRecognition") #Keep publisher to send word recognized self.pub = publisher #Install global variables needed by Naoqi self.install_naoqi_globals() #Check no one else is subscribed to this event subscribers = self.memory.getSubscribers(Constants.EVENT) if subscribers: rospy.logwarn("Speech recognition already in use by another node") for module in subscribers: self.stop(module) # Configure this instance self.reconfigure(config) #And subscribe to the event raised by speech recognition rospy.loginfo("Subscribing '{}' to NAO speech recognition".format( self.naoqi_name) ) self.memory.subscribeToEvent( Constants.EVENT, self.naoqi_name, self.on_word_recognised.func_name ) # Install global variables needed for Naoqi callbacks to work
Example #22
Source File: movo_head_jtas.py From kinova-movo with BSD 3-Clause "New" or "Revised" License | 4 votes |
def __init__(self, rate=100.0): self._alive = False self.init_success = False self._action_name = rospy.get_name() # Action Feedback/Result """ Define the joint names """ self._joint_names = ['pan_joint','tilt_joint'] """ Controller parameters from arguments, messages, and dynamic reconfigure """ self._trajectory_control_rate = rate # Hz self._goal_time = 0.0 self._stopped_velocity = 0.0 self._goal_error = dict() self._path_thresh = dict() self._traj_smoother = TrajectorySmoother(rospy.get_name(),"head") self._estop_delay = 0 self._fdbk = FollowJointTrajectoryFeedback() self._result = FollowJointTrajectoryResult() #self._dyn = reconfig_server self._ns = '/movo/head_controller' self._fjt_ns = self._ns + '/follow_joint_trajectory' self._server = actionlib.SimpleActionServer( self._fjt_ns, FollowJointTrajectoryAction, execute_cb=self._on_trajectory_action, auto_start=False) self._alive = True self.estop = False self._movo_status_sub = rospy.Subscriber("/movo/feedback/status",Status,self._update_movo_status) self._js = rospy.wait_for_message("/movo/head/joint_states",JointState) self.pos_targets = self._get_current_position(self._joint_names) self._sub = rospy.Subscriber("/movo/head/joint_states",JointState,self._update_movo_joint_states) self._cmd_pub=rospy.Publisher("/movo/head/cmd",PanTiltCmd,queue_size=10) self._server.start() self.init_success=True
Example #23
Source File: movo_torso_jtas.py From kinova-movo with BSD 3-Clause "New" or "Revised" License | 4 votes |
def __init__(self, rate=100.0): self._alive = False self.init_success = False self._action_name = rospy.get_name() # Action Feedback/Result """ Define the joint names """ self._joint_names = ['linear_joint'] """ Controller parameters from arguments, messages, and dynamic reconfigure """ self._trajectory_control_rate = rate # Hz self._goal_time = 0.0 self._stopped_velocity = 0.0 self._goal_error = dict() self._path_thresh = dict() self._estop_delay = 0 self._fdbk = FollowJointTrajectoryFeedback() self._result = FollowJointTrajectoryResult() #self._dyn = reconfig_server self._ns = '/movo/torso_controller' self._fjt_ns = self._ns + '/follow_joint_trajectory' self._server = actionlib.SimpleActionServer( self._fjt_ns, FollowJointTrajectoryAction, execute_cb=self._on_trajectory_action, auto_start=False) self._alive = True self.estop = False self._movo_status_sub = rospy.Subscriber("/movo/feedback/status",Status,self._update_movo_status) self._js = rospy.wait_for_message("/movo/linear_actuator/joint_states",JointState) self.pos_targets = self._get_current_position(self._joint_names) self._sub = rospy.Subscriber("/movo/linear_actuator/joint_states",JointState,self._update_movo_joint_states) self._cmd_pub=rospy.Publisher("/movo/linear_actuator_cmd",LinearActuatorCmd,queue_size=10) self._server.start() self.init_success=True
Example #24
Source File: pid_velocity.py From ROS-Programming-Building-Powerful-Robots with MIT License | 4 votes |
def __init__(self): ##################################################### rospy.init_node("pid_velocity") self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) ### initialize variables self.target = 0 self.motor = 0 self.vel = 0 self.integral = 0 self.error = 0 self.derivative = 0 self.previous_error = 0 self.wheel_prev = 0 self.wheel_latest = 0 self.then = rospy.Time.now() self.wheel_mult = 0 self.prev_encoder = 0 ### get parameters #### self.Kp = rospy.get_param('~Kp',10) self.Ki = rospy.get_param('~Ki',10) self.Kd = rospy.get_param('~Kd',0.001) self.out_min = rospy.get_param('~out_min',-255) self.out_max = rospy.get_param('~out_max',255) self.rate = rospy.get_param('~rate',30) self.rolling_pts = rospy.get_param('~rolling_pts',2) self.timeout_ticks = rospy.get_param('~timeout_ticks',4) self.ticks_per_meter = rospy.get_param('ticks_meter', 14860) self.vel_threshold = rospy.get_param('~vel_threshold', 0.001) self.encoder_min = rospy.get_param('encoder_min', -2147483648) self.encoder_max = rospy.get_param('encoder_max', 2147483648) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.prev_vel = [0.0] * self.rolling_pts self.wheel_latest = 0.0 self.prev_pid_time = rospy.Time.now() rospy.logdebug("%s got Kp:%0.3f Ki:%0.3f Kd:%0.3f tpm:%0.3f" % (self.nodename, self.Kp, self.Ki, self.Kd, self.ticks_per_meter)) #### subscribers/publishers rospy.Subscriber("wheel", Int64, self.wheelCallback) rospy.Subscriber("wheel_vtarget", Float32, self.targetCallback) self.pub_motor = rospy.Publisher('motor_cmd',Float32,queue_size=10) self.pub_vel = rospy.Publisher('wheel_vel', Float32,queue_size=10) #####################################################
Example #25
Source File: pid_velocity_sim.py From ROS-Programming-Building-Powerful-Robots with MIT License | 4 votes |
def __init__(self): ##################################################### rospy.init_node("pid_velocity") self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) ### initialize variables self.target = 0 self.motor = 0 self.vel = 0 self.integral = 0 self.error = 0 self.derivative = 0 self.previous_error = 0 self.wheel_prev = 0 self.wheel_latest = 0 self.then = rospy.Time.now() self.wheel_mult = 0 self.prev_encoder = 0 ### get parameters #### self.Kp = rospy.get_param('~Kp',10) self.Ki = rospy.get_param('~Ki',10) self.Kd = rospy.get_param('~Kd',0.001) self.out_min = rospy.get_param('~out_min',-255) self.out_max = rospy.get_param('~out_max',255) self.rate = rospy.get_param('~rate',30) self.rolling_pts = rospy.get_param('~rolling_pts',2) self.timeout_ticks = rospy.get_param('~timeout_ticks',4) self.ticks_per_meter = rospy.get_param('ticks_meter', 14860) self.vel_threshold = rospy.get_param('~vel_threshold', 0.001) self.encoder_min = rospy.get_param('encoder_min', -2147483648) self.encoder_max = rospy.get_param('encoder_max', 2147483648) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.prev_vel = [0.0] * self.rolling_pts self.wheel_latest = 0.0 self.prev_pid_time = rospy.Time.now() rospy.logdebug("%s got Kp:%0.3f Ki:%0.3f Kd:%0.3f tpm:%0.3f" % (self.nodename, self.Kp, self.Ki, self.Kd, self.ticks_per_meter)) #### subscribers/publishers rospy.Subscriber("wheel", Int64, self.wheelCallback) rospy.Subscriber("wheel_vtarget", Float32, self.targetCallback) self.pub_motor = rospy.Publisher('motor_cmd',Float32,queue_size=10) self.pub_vel = rospy.Publisher('wheel_vel', Float32,queue_size=10) #####################################################
Example #26
Source File: lpid_velocity.py From ROS-Programming-Building-Powerful-Robots with MIT License | 4 votes |
def __init__(self): ##################################################### rospy.init_node("lpid_velocity") self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) ### initialize variables self.target = 0 self.motor = 0 self.vel = 0 self.integral = 0 self.error = 0 self.derivative = 0 self.previous_error = 0 self.wheel_prev = 0 self.wheel_latest = 0 self.then = rospy.Time.now() self.wheel_mult = 0 self.prev_encoder = 0 ### get parameters #### self.Kp = rospy.get_param('~Kp',10) self.Ki = rospy.get_param('~Ki',10) self.Kd = rospy.get_param('~Kd',0.001) self.out_min = rospy.get_param('~out_min',-255) self.out_max = rospy.get_param('~out_max',255) self.rate = rospy.get_param('~rate',30) self.rolling_pts = rospy.get_param('~rolling_pts',2) self.timeout_ticks = rospy.get_param('~timeout_ticks',4) self.ticks_per_meter = rospy.get_param('ticks_meter', 20) self.vel_threshold = rospy.get_param('~vel_threshold', 0.001) self.encoder_min = rospy.get_param('encoder_min', -32768) self.encoder_max = rospy.get_param('encoder_max', 32768) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.prev_vel = [0.0] * self.rolling_pts self.wheel_latest = 0.0 self.prev_pid_time = rospy.Time.now() rospy.logdebug("%s got Kp:%0.3f Ki:%0.3f Kd:%0.3f tpm:%0.3f" % (self.nodename, self.Kp, self.Ki, self.Kd, self.ticks_per_meter)) #### subscribers/publishers rospy.Subscriber("wheel", Int16, self.wheelCallback) rospy.Subscriber("wheel_vtarget", Float32, self.targetCallback) self.pub_motor = rospy.Publisher('motor_cmd',Float32,queue_size=10) self.pub_vel = rospy.Publisher('wheel_vel', Float32,queue_size=10) #####################################################
Example #27
Source File: pid_velocity.py From ROS-Programming-Building-Powerful-Robots with MIT License | 4 votes |
def __init__(self): ##################################################### rospy.init_node("pid_velocity") self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) ### initialize variables self.target = 0 self.motor = 0 self.vel = 0 self.integral = 0 self.error = 0 self.derivative = 0 self.previous_error = 0 self.wheel_prev = 0 self.wheel_latest = 0 self.then = rospy.Time.now() self.wheel_mult = 0 self.prev_encoder = 0 ### get parameters #### self.Kp = rospy.get_param('~Kp',10) self.Ki = rospy.get_param('~Ki',10) self.Kd = rospy.get_param('~Kd',0.001) self.out_min = rospy.get_param('~out_min',-255) self.out_max = rospy.get_param('~out_max',255) self.rate = rospy.get_param('~rate',30) self.rolling_pts = rospy.get_param('~rolling_pts',2) self.timeout_ticks = rospy.get_param('~timeout_ticks',4) self.ticks_per_meter = rospy.get_param('ticks_meter', 14860) self.vel_threshold = rospy.get_param('~vel_threshold', 0.001) self.encoder_min = rospy.get_param('encoder_min', -2147483648) self.encoder_max = rospy.get_param('encoder_max', 2147483648) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.prev_vel = [0.0] * self.rolling_pts self.wheel_latest = 0.0 self.prev_pid_time = rospy.Time.now() rospy.logdebug("%s got Kp:%0.3f Ki:%0.3f Kd:%0.3f tpm:%0.3f" % (self.nodename, self.Kp, self.Ki, self.Kd, self.ticks_per_meter)) #### subscribers/publishers rospy.Subscriber("wheel", Int64, self.wheelCallback) rospy.Subscriber("wheel_vtarget", Float32, self.targetCallback) self.pub_motor = rospy.Publisher('motor_cmd',Float32,queue_size=10) self.pub_vel = rospy.Publisher('wheel_vel', Float32,queue_size=10) #####################################################
Example #28
Source File: pid_velocity_sim.py From ROS-Programming-Building-Powerful-Robots with MIT License | 4 votes |
def __init__(self): ##################################################### rospy.init_node("pid_velocity") self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) ### initialize variables self.target = 0 self.motor = 0 self.vel = 0 self.integral = 0 self.error = 0 self.derivative = 0 self.previous_error = 0 self.wheel_prev = 0 self.wheel_latest = 0 self.then = rospy.Time.now() self.wheel_mult = 0 self.prev_encoder = 0 ### get parameters #### self.Kp = rospy.get_param('~Kp',10) self.Ki = rospy.get_param('~Ki',10) self.Kd = rospy.get_param('~Kd',0.001) self.out_min = rospy.get_param('~out_min',-255) self.out_max = rospy.get_param('~out_max',255) self.rate = rospy.get_param('~rate',30) self.rolling_pts = rospy.get_param('~rolling_pts',2) self.timeout_ticks = rospy.get_param('~timeout_ticks',4) self.ticks_per_meter = rospy.get_param('ticks_meter', 14860) self.vel_threshold = rospy.get_param('~vel_threshold', 0.001) self.encoder_min = rospy.get_param('encoder_min', -2147483648) self.encoder_max = rospy.get_param('encoder_max', 2147483648) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.prev_vel = [0.0] * self.rolling_pts self.wheel_latest = 0.0 self.prev_pid_time = rospy.Time.now() rospy.logdebug("%s got Kp:%0.3f Ki:%0.3f Kd:%0.3f tpm:%0.3f" % (self.nodename, self.Kp, self.Ki, self.Kd, self.ticks_per_meter)) #### subscribers/publishers rospy.Subscriber("wheel", Int64, self.wheelCallback) rospy.Subscriber("wheel_vtarget", Float32, self.targetCallback) self.pub_motor = rospy.Publisher('motor_cmd',Float32,queue_size=10) self.pub_vel = rospy.Publisher('wheel_vel', Float32,queue_size=10) #####################################################
Example #29
Source File: rpid_velocity.py From ROS-Programming-Building-Powerful-Robots with MIT License | 4 votes |
def __init__(self): ##################################################### rospy.init_node("rpid_velocity") self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) ### initialize variables self.target = 0 self.motor = 0 self.vel = 0 self.integral = 0 self.error = 0 self.derivative = 0 self.previous_error = 0 self.wheel_prev = 0 self.wheel_latest = 0 self.then = rospy.Time.now() self.wheel_mult = 0 self.prev_encoder = 0 ### get parameters #### self.Kp = rospy.get_param('~Kp',10) self.Ki = rospy.get_param('~Ki',10) self.Kd = rospy.get_param('~Kd',0.001) self.out_min = rospy.get_param('~out_min',-255) self.out_max = rospy.get_param('~out_max',255) self.rate = rospy.get_param('~rate',30) self.rolling_pts = rospy.get_param('~rolling_pts',2) self.timeout_ticks = rospy.get_param('~timeout_ticks',4) self.ticks_per_meter = rospy.get_param('ticks_meter', 20) self.vel_threshold = rospy.get_param('~vel_threshold', 0.001) self.encoder_min = rospy.get_param('encoder_min', -32768) self.encoder_max = rospy.get_param('encoder_max', 32768) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.prev_vel = [0.0] * self.rolling_pts self.wheel_latest = 0.0 self.prev_pid_time = rospy.Time.now() rospy.logdebug("%s got Kp:%0.3f Ki:%0.3f Kd:%0.3f tpm:%0.3f" % (self.nodename, self.Kp, self.Ki, self.Kd, self.ticks_per_meter)) #### subscribers/publishers rospy.Subscriber("wheel", Int16, self.wheelCallback) rospy.Subscriber("wheel_vtarget", Float32, self.targetCallback) self.pub_motor = rospy.Publisher('motor_cmd',Float32,queue_size=10) self.pub_vel = rospy.Publisher('wheel_vel', Float32,queue_size=10) #####################################################
Example #30
Source File: lpid_velocity.py From ROS-Programming-Building-Powerful-Robots with MIT License | 4 votes |
def __init__(self): ##################################################### rospy.init_node("lpid_velocity") self.nodename = rospy.get_name() rospy.loginfo("%s started" % self.nodename) ### initialize variables self.target = 0 self.motor = 0 self.vel = 0 self.integral = 0 self.error = 0 self.derivative = 0 self.previous_error = 0 self.wheel_prev = 0 self.wheel_latest = 0 self.then = rospy.Time.now() self.wheel_mult = 0 self.prev_encoder = 0 ### get parameters #### self.Kp = rospy.get_param('~Kp',10) self.Ki = rospy.get_param('~Ki',10) self.Kd = rospy.get_param('~Kd',0.001) self.out_min = rospy.get_param('~out_min',-255) self.out_max = rospy.get_param('~out_max',255) self.rate = rospy.get_param('~rate',30) self.rolling_pts = rospy.get_param('~rolling_pts',2) self.timeout_ticks = rospy.get_param('~timeout_ticks',4) self.ticks_per_meter = rospy.get_param('ticks_meter', 20) self.vel_threshold = rospy.get_param('~vel_threshold', 0.001) self.encoder_min = rospy.get_param('encoder_min', -32768) self.encoder_max = rospy.get_param('encoder_max', 32768) self.encoder_low_wrap = rospy.get_param('wheel_low_wrap', (self.encoder_max - self.encoder_min) * 0.3 + self.encoder_min ) self.encoder_high_wrap = rospy.get_param('wheel_high_wrap', (self.encoder_max - self.encoder_min) * 0.7 + self.encoder_min ) self.prev_vel = [0.0] * self.rolling_pts self.wheel_latest = 0.0 self.prev_pid_time = rospy.Time.now() rospy.logdebug("%s got Kp:%0.3f Ki:%0.3f Kd:%0.3f tpm:%0.3f" % (self.nodename, self.Kp, self.Ki, self.Kd, self.ticks_per_meter)) #### subscribers/publishers rospy.Subscriber("wheel", Int16, self.wheelCallback) rospy.Subscriber("wheel_vtarget", Float32, self.targetCallback) self.pub_motor = rospy.Publisher('motor_cmd',Float32,queue_size=10) self.pub_vel = rospy.Publisher('wheel_vel', Float32,queue_size=10) #####################################################