Python rospy.Publisher() Examples
The following are 30
code examples of rospy.Publisher().
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: google_client.py From dialogflow_ros with MIT License | 9 votes |
def __init__(self): # Audio stream input setup FORMAT = pyaudio.paInt16 CHANNELS = 1 RATE = 16000 self.CHUNK = 4096 self.audio = pyaudio.PyAudio() self.stream = self.audio.open(format=FORMAT, channels=CHANNELS, rate=RATE, input=True, frames_per_buffer=self.CHUNK, stream_callback=self.get_data) self._buff = Queue.Queue() # Buffer to hold audio data self.closed = False # ROS Text Publisher self.text_pub = rospy.Publisher('/google_client/text', String, queue_size=10) # Context clues in yaml file rospack = rospkg.RosPack() yamlFileDir = rospack.get_path('dialogflow_ros') + '/config/context.yaml' with open(yamlFileDir, 'r') as f: self.context = yaml.load(f)
Example #2
Source File: multi_goals.py From tianbot_racecar with GNU General Public License v3.0 | 8 votes |
def __init__(self, goalListX, goalListY, retry, map_frame): self.sub = rospy.Subscriber('move_base/result', MoveBaseActionResult, self.statusCB, queue_size=10) self.pub = rospy.Publisher('move_base_simple/goal', PoseStamped, queue_size=10) # params & variables self.goalListX = goalListX self.goalListY = goalListY self.retry = retry self.goalId = 0 self.goalMsg = PoseStamped() self.goalMsg.header.frame_id = map_frame self.goalMsg.pose.orientation.z = 0.0 self.goalMsg.pose.orientation.w = 1.0 # Publish the first goal time.sleep(1) self.goalMsg.header.stamp = rospy.Time.now() self.goalMsg.pose.position.x = self.goalListX[self.goalId] self.goalMsg.pose.position.y = self.goalListY[self.goalId] self.pub.publish(self.goalMsg) rospy.loginfo("Initial goal published! Goal ID is: %d", self.goalId) self.goalId = self.goalId + 1
Example #3
Source File: head_lift_joy.py From cozmo_driver with Apache License 2.0 | 7 votes |
def __init__(self): """ Create HeadLiftJoy object. """ # params self._head_axes = rospy.get_param('~head_axes', 3) self._lift_axes = rospy.get_param('~lift_axes', 3) self._head_button = rospy.get_param('~head_button', 4) self._lift_button = rospy.get_param('~lift_button', 5) # pubs self._head_pub = rospy.Publisher('head_angle', Float64, queue_size=1) self._lift_pub = rospy.Publisher('lift_height', Float64, queue_size=1) # subs self._joy_sub = rospy.Subscriber('joy', Joy, self._joy_cb, queue_size=1)
Example #4
Source File: rudder_control_heading.py From usv_sim_lsa with Apache License 2.0 | 7 votes |
def talker_ctrl(): global rate_value rospy.init_node('usv_simple_ctrl', anonymous=True) rate = rospy.Rate(rate_value) # 10h # publishes to thruster and rudder topics pub_motor = rospy.Publisher('thruster_command', JointState, queue_size=10) pub_rudder = rospy.Publisher('joint_setpoint', JointState, queue_size=10) pub_result = rospy.Publisher('move_usv/result', Float64, queue_size=10) # subscribe to state and targer point topics rospy.Subscriber("state", Odometry, get_pose) # get usv position (add 'gps' position latter) rospy.Subscriber("move_usv/goal", Odometry, get_target) # get target position while not rospy.is_shutdown(): try: pub_motor.publish(thruster_ctrl_msg()) pub_rudder.publish(rudder_ctrl_msg()) pub_result.publish(verify_result()) rate.sleep() except rospy.ROSInterruptException: rospy.logerr("ROS Interrupt Exception! Just ignore the exception!") except rospy.ROSTimeMovedBackwardsException: rospy.logerr("ROS Time Backwards! Just ignore the exception!")
Example #5
Source File: ros_svm.py From ROS-Programming-Building-Powerful-Robots with MIT License | 7 votes |
def listener(): global obj global pub rospy.loginfo("Starting prediction node") rospy.init_node('listener', anonymous = True) rospy.Subscriber("sensor_read", Int32, read_sensor_data) pub = rospy.Publisher('predict', Int32, queue_size=1) obj = Classify_Data() obj.read_file('pos_readings.csv') obj.train() rospy.spin()
Example #6
Source File: rudder_control_heading_old.py From usv_sim_lsa with Apache License 2.0 | 7 votes |
def talker_ctrl(): global rate_value # publishes to thruster and rudder topics pub_motor = rospy.Publisher('thruster_command', JointState, queue_size=10) pub_rudder = rospy.Publisher('joint_setpoint', JointState, queue_size=10) rospy.init_node('usv_simple_ctrl', anonymous=True) rate = rospy.Rate(rate_value) # 10h # subscribe to state and targer point topics rospy.Subscriber("state", Odometry, get_pose) # get usv position (add 'gps' position latter) rospy.Subscriber("usv_position_setpoint", Odometry, get_target) # get target position while not rospy.is_shutdown(): pub_motor.publish(thruster_ctrl_msg()) pub_rudder.publish(rudder_ctrl_msg()) rate.sleep()
Example #7
Source File: boat_rudder_vel_ctrl.py From usv_sim_lsa with Apache License 2.0 | 7 votes |
def __init__(self): rospy.init_node('usv_vel_ctrl', anonymous=False) self.rate = 10 r = rospy.Rate(self.rate) # 10hertz self.usv_vel = Odometry() self.usv_vel_ant = Odometry() self.target_vel = Twist() self.target_vel_ant = Twist() self.thruster_msg = JointState() self.rudder_msg = JointState() self.thruster_msg.header = Header() self.rudder_msg.header = Header() self.kp_lin = 80 self.ki_lin = 200 thruster_name = 'fwd' rudder_name = 'rudder_joint' self.I_ant_lin = 0 self.I_ant_ang = 0 self.lin_vel = 0 self.lin_vel_ang = 0 self.ang_vel = 0 self.kp_ang = 2 self.ki_ang = 4 self.rudder_max = 70 self.thruster_max = 30 self.pub_motor = rospy.Publisher('thruster_command', JointState, queue_size=10) self.pub_rudder = rospy.Publisher('joint_setpoint', JointState, queue_size=10) rospy.Subscriber("state", Odometry, self.get_usv_vel) rospy.Subscriber("cmd_vel", Twist, self.get_target_vel) while not rospy.is_shutdown(): self.pub_rudder.publish(self.rudder_ctrl_msg(self.ang_vel_ctrl(), rudder_name)) self.pub_motor.publish(self.thruster_ctrl_msg(self.lin_vel_ctrl(), thruster_name)) r.sleep()
Example #8
Source File: navigation_pub.py From usv_sim_lsa with Apache License 2.0 | 7 votes |
def navigation(): pub = rospy.Publisher('usv_position_setpoint', Odometry, queue_size=10) # only create a rostopic, navigation system TODO rospy.init_node('navigation_publisher') rate = rospy.Rate(60) # 10h x = -20.0 y = -20.0 msg = Odometry() # msg.header = Header() msg.header.stamp = rospy.Time.now() msg.header.frame_id = "navigation" msg.pose.pose.position = Point(x, y, 0.) while not rospy.is_shutdown(): pub.publish(msg) rate.sleep()
Example #9
Source File: widowx_controller.py From visual_foresight with MIT License | 6 votes |
def __init__(self, robot_name, print_debug, email_cred_file='', log_file='', control_rate=100, gripper_attached='default'): super(WidowXController, self).__init__(robot_name, print_debug, email_cred_file, log_file, control_rate, gripper_attached) self._redist_rate = rospy.Rate(50) self._arbotix = ArbotiX('/dev/ttyUSB0') assert self._arbotix.syncWrite(MAX_TORQUE_L, [[servo_id, 255, 0] for servo_id in SERVO_IDS]) != -1, "failure during servo configuring" assert self._arbotix.syncWrite(TORQUE_LIMIT, [[servo_id, 255, 0] for servo_id in SERVO_IDS]) != -1, "failure during servo configuring" self._joint_lock = Lock() self._angles, self._velocities = {}, {} rospy.Subscriber("/joint_states", JointState, self._joint_callback) time.sleep(1) self._joint_pubs = [rospy.Publisher('/{}/command'.format(name), Float64, queue_size=1) for name in JOINT_NAMES[:-1]] self._gripper_pub = rospy.Publisher('/gripper_prismatic_joint/command', Float64, queue_size=1) p.connect(p.DIRECT) widow_x_urdf = '/'.join(__file__.split('/')[:-1]) + '/widowx/widowx.urdf' self._armID = p.loadURDF(widow_x_urdf, useFixedBase=True) p.resetBasePositionAndOrientation(self._armID, [0, 0, 0], p.getQuaternionFromEuler([np.pi, np.pi, np.pi])) self._n_errors = 0
Example #10
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 #11
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 #12
Source File: teleop_key.py From cozmo_driver with Apache License 2.0 | 6 votes |
def __init__(self): # setup CozmoTeleop.settings = termios.tcgetattr(sys.stdin) atexit.register(self.reset_terminal) # vars self.head_angle = STD_HEAD_ANGLE self.lift_height = STD_LIFT_HEIGHT # params self.lin_vel = rospy.get_param('~lin_vel', 0.2) self.ang_vel = rospy.get_param('~ang_vel', 1.5757) # pubs self._head_pub = rospy.Publisher('head_angle', Float64, queue_size=1) self._lift_pub = rospy.Publisher('lift_height', Float64, queue_size=1) self._cmd_vel_pub = rospy.Publisher('cmd_vel', Twist, queue_size=1)
Example #13
Source File: sailboat_control_heading.py From usv_sim_lsa with Apache License 2.0 | 6 votes |
def talker_ctrl(): global rate_value global currentHeading global windDir global isTacking global heeling global spHeading rospy.init_node('usv_simple_ctrl', anonymous=True) rate = rospy.Rate(rate_value) # 10h # publishes to thruster and rudder topics #pub_sail = rospy.Publisher('angleLimits', Float64, queue_size=10) pub_rudder = rospy.Publisher('joint_setpoint', JointState, queue_size=10) pub_result = rospy.Publisher('move_usv/result', Float64, queue_size=10) pub_heading = rospy.Publisher('currentHeading', Float64, queue_size=10) pub_windDir = rospy.Publisher('windDirection', Float64, queue_size=10) pub_heeling = rospy.Publisher('heeling', Float64, queue_size=10) pub_spHeading = rospy.Publisher('spHeading', Float64, queue_size=10) # subscribe to state and targer point topics rospy.Subscriber("state", Odometry, get_pose) # get usv position (add 'gps' position latter) rospy.Subscriber("move_usv/goal", Odometry, get_target) # get target position while not rospy.is_shutdown(): try: pub_rudder.publish(rudder_ctrl_msg()) #pub_sail.publish(sail_ctrl()) pub_result.publish(verify_result()) pub_heading.publish(currentHeading) pub_windDir.publish(windDir) pub_heeling.publish(heeling) pub_spHeading.publish(spHeading) rate.sleep() except rospy.ROSInterruptException: rospy.logerr("ROS Interrupt Exception! Just ignore the exception!") except rospy.ROSTimeMovedBackwardsException: rospy.logerr("ROS Time Backwards! Just ignore the exception!")
Example #14
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 #15
Source File: wsg50_gripper.py From visual_foresight with MIT License | 6 votes |
def __init__(self): super(WSG50Gripper, self).__init__() self.max_release = 0 self.sem_list = [Semaphore(value = 0)] self._status_mutex = Lock() self._desired_gpos = GRIPPER_OPEN self._gripper_speed = 300 self._force_counter = 0 self._integrate_gripper_force, self._last_integrate = 0., None self._last_status_t = time.time() self.num_timeouts = 0 self.gripper_pub = rospy.Publisher('/wsg_50_driver/goal_position', Cmd, queue_size=10) rospy.Subscriber("/wsg_50_driver/status", Status, self._gripper_callback) logging.getLogger('robot_logger').info("waiting for first status") self.sem_list[0].acquire() logging.getLogger('robot_logger').info('gripper initialized!') self._bg = Thread(target=self._background_monitor) self._bg.start()
Example #16
Source File: mic_client.py From dialogflow_ros with MIT License | 6 votes |
def __init__(self): # Audio stream input setup FORMAT = pyaudio.paInt16 CHANNELS = 1 RATE = 16000 self.CHUNK = 4096 self.audio = pyaudio.PyAudio() self.stream = self.audio.open(format=FORMAT, channels=CHANNELS, rate=RATE, input=True, frames_per_buffer=self.CHUNK, stream_callback=self._get_data) self._buff = Queue.Queue() # Buffer to hold audio data self.closed = False # ROS Text Publisher text_topic = rospy.get_param('/text_topic', '/dialogflow_text') self.text_pub = rospy.Publisher(text_topic, String, queue_size=10)
Example #17
Source File: racecar_joy.py From tianbot_racecar with GNU General Public License v3.0 | 6 votes |
def __init__(self): rospy.loginfo("Tianbot Racecar JoyTeleop Initializing...") self._twist = Twist() self._twist.linear.x = 1500 self._twist.angular.z = 90 self._deadman_pressed = False self._zero_twist_published = False self._cmd_vel_pub = rospy.Publisher('~/car/cmd_vel', Twist, queue_size=5) self._joy_sub = rospy.Subscriber('/joy', Joy, self.joy_callback) self._timer = rospy.Timer(rospy.Duration(0.05), self.joystick_controller) self._axis_throttle = 1 _joy_mode = rospy.get_param("~joy_mode", "D").lower() if _joy_mode == "d": self._axis_servo = 2 if _joy_mode == "x": self._axis_servo = 3 self._throttle_scale = rospy.get_param("~throttle_scale", 0.5) self._servo_scale = rospy.get_param("~servo_scale", 1)
Example #18
Source File: kitti_LidarImg_data_provider.py From Attentional-PointNet with GNU General Public License v3.0 | 5 votes |
def ros_pub(points,topic,color): pcl_pub = rospy.Publisher("/all_points", PointCloud2, queue_size=10) points = points.cpu().detach().numpy() cloud_msg = xyzrgb_array_to_pointcloud2(points,color,stamp =rospy.Time.now(), frame_id = "zoe/base_link" ) rospy.loginfo("happily publishing sample pointcloud.. !") pcl_pub.publish(cloud_msg) rospy.sleep(0.1)
Example #19
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 #20
Source File: arduino_bkup.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def __init__(self, port="/dev/ttyUSB0", baudrate=9600): ''' Initializes the receiver class. port: The serial port to listen to. baudrate: Baud rate for the serial communication ''' self._Counter = 0 rospy.init_node('arduino') port = rospy.get_param("~port", "/dev/ttyUSB0") baudRate = int(rospy.get_param("~baudRate", 9600)) rospy.loginfo("Starting with serial port: " + port + ", baud rate: " + str(baudRate)) # subscriptions rospy.Subscriber("cmd_vel", Twist, self._HandleVelocityCommand) self._SerialPublisher = rospy.Publisher('serial', String) self._OdometryTransformBroadcaster = tf.TransformBroadcaster() self._OdometryPublisher = rospy.Publisher("odom", Odometry) # self._VoltageLowlimit = rospy.get_param("~batteryStateParams/voltageLowlimit", "12.0") # self._VoltageLowLowlimit = rospy.get_param("~batteryStateParams/voltageLowLowlimit", "11.7") # self._BatteryStatePublisher = rospy.Publisher("battery", BatteryState) self._SetDriveGainsService = rospy.Service('setDriveControlGains', SetDriveControlGains, self._HandleSetDriveGains) self._State = Arduino.CONTROLLER_RESET_REQUIRED self._SerialDataGateway = SerialDataGateway(port, baudRate, self._HandleReceivedLine)
Example #21
Source File: arduino_bkup.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def __init__(self, port="/dev/ttyUSB0", baudrate=9600): ''' Initializes the receiver class. port: The serial port to listen to. baudrate: Baud rate for the serial communication ''' self._Counter = 0 rospy.init_node('arduino') port = rospy.get_param("~port", "/dev/ttyUSB0") baudRate = int(rospy.get_param("~baudRate", 9600)) rospy.loginfo("Starting with serial port: " + port + ", baud rate: " + str(baudRate)) # subscriptions rospy.Subscriber("cmd_vel", Twist, self._HandleVelocityCommand) self._SerialPublisher = rospy.Publisher('serial', String) self._OdometryTransformBroadcaster = tf.TransformBroadcaster() self._OdometryPublisher = rospy.Publisher("odom", Odometry) # self._VoltageLowlimit = rospy.get_param("~batteryStateParams/voltageLowlimit", "12.0") # self._VoltageLowLowlimit = rospy.get_param("~batteryStateParams/voltageLowLowlimit", "11.7") # self._BatteryStatePublisher = rospy.Publisher("battery", BatteryState) self._SetDriveGainsService = rospy.Service('setDriveControlGains', SetDriveControlGains, self._HandleSetDriveGains) self._State = Arduino.CONTROLLER_RESET_REQUIRED self._SerialDataGateway = SerialDataGateway(port, baudRate, self._HandleReceivedLine)
Example #22
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 #23
Source File: kitti_LidarImg_data_provider.py From Attentional-PointNet with GNU General Public License v3.0 | 5 votes |
def ros_pub_marker(loc): marker_pub = rospy.Publisher("/marker_topic", Marker, queue_size=10) # print(loc[3]) quat = quaternion_from_euler(0, 0, loc[3]) marker = Marker() marker.header.frame_id = "zoe/base_link" marker.type = marker.CUBE marker.action = marker.ADD marker.scale.x = 2.5 marker.scale.y = 5 marker.scale.z = 2 marker.color.a = 0.4 marker.color.r = 0.9 marker.color.g = 0.1 marker.color.b = 0.2 marker.pose.orientation.x = quat[0] marker.pose.orientation.y = quat[1] marker.pose.orientation.z = quat[2] marker.pose.orientation.w = quat[3] marker.pose.position.x = loc[0] marker.pose.position.y = loc[1] marker.pose.position.z = loc[2] # marker.lifetime = rospy.Duration(1) rospy.sleep(0.2) # while (True): for i in range(5): marker_pub.publish(marker) # rospy.sleep(0.1)
Example #24
Source File: virtual_joystick.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def __init__(self): ##################################################################### super(MainWindow, self).__init__() self.timer_rate = rospy.get_param('~publish_rate', 50) self.pub_twist = rospy.Publisher('twist', Twist,queue_size=10) self.initUI() #####################################################################
Example #25
Source File: DeadReckoning.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def __init__(self): rospy.init_node('DeadReckoning') self._VelocityCommandPublisher = rospy.Publisher("cmd_vel", Twist) self._TransformListener = tf.TransformListener() # wait for the listener to get the first transform message self._TransformListener.waitForTransform("/odom", "/base_link", rospy.Time(), rospy.Duration(4.0))
Example #26
Source File: base_controller.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def __init__(self, Serializer, name): Thread.__init__ (self) self.finished = Event() # Handle for the Serializer self.mySerializer = Serializer # Parameters self.rate = float(rospy.get_param("~base_controller_rate", 10)) self.ticks_per_meter = float(self.mySerializer.ticks_per_meter) self.wheel_track = self.mySerializer.wheel_track self.gear_reduction = self.mySerializer.gear_reduction self.encoder_resolution = self.mySerializer.encoder_resolution now = rospy.Time.now() self.t_delta = rospy.Duration(1.0/self.rate) self.t_next = now + self.t_delta self.then = now # time for determining dx/dy # internal data self.enc_left = 0 # encoder readings self.enc_right = 0 self.x = 0. # position in xy plane self.y = 0. self.th = 0. # rotation in radians self.encoder_error = False # subscriptions rospy.Subscriber("cmd_vel", Twist, self.cmdVelCallback) # Clear any old odometry info self.mySerializer.clear_encoder([1, 2]) # Set up the odometry broadcaster self.odomPub = rospy.Publisher('odom', Odometry) self.odomBroadcaster = TransformBroadcaster() rospy.loginfo("Started Base Controller '"+ name +"' for a base of " + str(self.wheel_track) + "m wide with " + str(self.ticks_per_meter) + " ticks per meter")
Example #27
Source File: register_wsg.py From visual_foresight with MIT License | 5 votes |
def send_urdf(parent_link, root_joint, urdf_filename, duration): """ Send the URDF Fragment located at the specified path. @param parent_link: parent link to attach the URDF fragment to (usually <side>_hand) @param root_joint: root link of the URDF fragment (usually <side>_gripper_base) @param urdf_filename: path to the urdf XML file to load into xacro and send @param duration: duration to repeat sending the URDF to ensure it is received """ msg = URDFConfiguration() # The updating the time parameter tells # the robot that this is a new configuration. # Only update the time when an updated internal # model is required. Do not continuously update # the time parameter. msg.time = rospy.Time.now() # link to attach this urdf to onboard the robot msg.link = parent_link # root linkage in your URDF Fragment msg.joint = root_joint msg.urdf = xacro_parse(urdf_filename) pub = rospy.Publisher('/robot/urdf', URDFConfiguration, queue_size=10) rate = rospy.Rate(5) # 5hz start = rospy.Time.now() rospy.loginfo('publishing urdf') while not rospy.is_shutdown(): pub.publish(msg) rate.sleep() if (rospy.Time.now() - msg.time) > rospy.Duration(duration): break
Example #28
Source File: sawyer_impedance.py From visual_foresight with MIT License | 5 votes |
def __init__(self, robot_name='sawyer', print_debug=False, email_cred_file='', log_file='', control_rate=800, gripper_attached='wsg-50'): super(SawyerImpedanceController, self).__init__(robot_name, print_debug, email_cred_file, log_file, control_rate, gripper_attached) self._rs = intera_interface.RobotEnable(intera_interface.CHECK_VERSION) self._limb = intera_interface.Limb("right") self.joint_names = self._limb.joint_names() self._ep_handler = LatestEEObs() self._cmd_publisher = rospy.Publisher('/robot/limb/right/joint_command', JointCommand, queue_size=100)
Example #29
Source File: virtual_joystick.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def __init__(self): ##################################################################### super(MainWindow, self).__init__() self.timer_rate = rospy.get_param('~publish_rate', 50) self.pub_twist = rospy.Publisher('twist', Twist,queue_size=10) self.initUI() #####################################################################
Example #30
Source File: virtual_joystick.py From differential-drive with GNU General Public License v3.0 | 5 votes |
def __init__(self): ##################################################################### super(MainWindow, self).__init__() self.timer_rate = rospy.get_param('~publish_rate', 50) self.pub_twist = rospy.Publisher('twist', Twist, queue_size=10) self.initUI() #####################################################################