Python rospy.Subscriber() Examples
The following are 30
code examples of rospy.Subscriber().
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: 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 #2
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 #3
Source File: wheel_scaler.py From differential-drive with GNU General Public License v3.0 | 7 votes |
def scaleWheel(): rospy.init_node("wheel_scaler") rospy.loginfo("wheel_scaler started") scale = rospy.get_param('distance_scale', 1) rospy.loginfo("wheel_scaler scale: %0.2f", scale) rospy.Subscriber("lwheel", Int16, lwheelCallback) rospy.Subscriber("rwheel", Int16, rwheelCallback) lscaled_pub = rospy.Publisher("lwheel_scaled", Int16, queue_size=10) rscaled_pub = rospy.Publisher("rwheel_scaled", Int16, queue_size=10) ### testing sleep CPU usage r = rospy.Rate(50) while not rospy.is_shutdown: r.sleep() rospy.spin()
Example #4
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 #5
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 #6
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 #7
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 #8
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 #9
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 #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 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 #12
Source File: airboat_control_heading.py From usv_sim_lsa with Apache License 2.0 | 6 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 #13
Source File: diff_control_heading.py From usv_sim_lsa with Apache License 2.0 | 6 votes |
def talker_ctrl(): global rate_value global result # publishes to thruster and rudder topics pub_motor = rospy.Publisher('thruster_command', JointState, queue_size=10) pub_result = rospy.Publisher('move_usv/result', Float64, 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("move_usv/goal", Odometry, get_target) # get target position while not rospy.is_shutdown(): try: pub_motor.publish(thruster_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 #14
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 #15
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 #16
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 #17
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 #18
Source File: TopicConnector.py From openag_cv with GNU General Public License v3.0 | 5 votes |
def Subscriber(SubscribingTopicName,SubscribingMsgType): # In ROS, nodes are uniquely named. If two nodes with the same # node are launched, the previous one is kicked off. The # anonymous=True flag means that rospy will choose a unique # name for our 'listener' node so that multiple listeners can # run simultaneously. rospy.init_node('Topic_Connection', anonymous=True) # Topic you want to subscribe rospy.Subscriber(SubscribingTopicName, SubscribingMsgType, callback)
Example #19
Source File: velocityLogger.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def start(self): self._OutputFile = open(self._OutputFilePath, "w") self._StartTime = time.time() self._LastTimestamp = startTime rospy.Subscriber(self._OdomTopic, Odometry, self._onOdomMessageReceived)
Example #20
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 #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: Evaluation.py From drl_local_planner_ros_stable_baselines with BSD 3-Clause "New" or "Revised" License | 5 votes |
def __init__(self, state_collector, ns, robot_radius = 0,robot_width = 0.58, robot_height = 0.89): self.__robot_radius = robot_radius # robot radius self.__robot_height = robot_height # robot width self.__robot_width = robot_width # robot heigth self.__odom = Odometry() # most recently published odometry of the robot self.__path = Path() # most recently published path self.__done = False # is episode done? self.__new_task_started = False # has a new task started? self.__state_collector = state_collector # for getting relevant state values of the robot self.__rl_agent_path = rospkg.RosPack().get_path('rl_agent') # absolute path rl_agent-package self.__flatland_topics = [] # list of flatland topics self.__timestep = 0 # actual timestemp of training self.__NS = ns self.MODE = rospy.get_param("%s/rl_agent/train_mode", 1) self.__clock = Clock().clock self.__task_generator = TaskGenerator(self.__NS, self.__state_collector, 0.46) self.__recent_agent_states = [] # Subscriber for getting data #self.__odom_sub = rospy.Subscriber("%s/odom"%self.__NS, Odometry, self.__odom_callback, queue_size=1) self.__global_plan_sub = rospy.Subscriber("%s/move_base/NavfnROS/plan"%self.__NS, Path, self.__path_callback, queue_size=1) # self.__path_sub = rospy.Subscriber("%s/move_base/GlobalPlanner/plan" % self.__NS, Path, self.__path_callback, queue_size=1) self.__done_sub = rospy.Subscriber("%s/rl_agent/done"%self.__NS, Bool, self.__done_callback, queue_size=1) self.__new_task_sub = rospy.Subscriber('%s/rl_agent/new_task_started'%self.__NS, Bool, self.__new_task_callback, queue_size=1) self.__flatland_topics_sub = rospy.Subscriber("%s/flatland_server/debug/topics"%self.__NS, DebugTopicList, self.__flatland_topic_callback, queue_size=1) self.__agent_action_sub = rospy.Subscriber('%s/rl_agent/action'%self.__NS, Twist, self.__trigger_callback) self.__ped_sub = rospy.Subscriber('%s/pedsim_simulator/simulated_agents' % self.__NS, AgentStates, self.__ped_callback) if self.MODE == 1 or self.MODE == 0: self.clock_sub = rospy.Subscriber('%s/clock' % self.__NS, Clock, self.__clock_callback) # Publisher for generating qualitative image self.__driven_path_pub = rospy.Publisher('%s/rl_eval/driven_path'%self.__NS, Path, queue_size=1) self.__driven_path_pub2 = rospy.Publisher('%s/rl_eval/driven_path2'%self.__NS, Path, queue_size=1) self.__global_path_pub = rospy.Publisher('%s/rl_eval/global_path'%self.__NS, Path, queue_size=1) self.__agent_pub = rospy.Publisher('%s/rl_eval/viz_agents'%self.__NS, MarkerArray, queue_size=1)
Example #23
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 #24
Source File: aiml_tts_client.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def listener(): rospy.loginfo("Starting listening to response") rospy.Subscriber("response",String, get_response,queue_size=10) rospy.spin()
Example #25
Source File: velocityLogger.py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def start(self): self._OutputFile = open(self._OutputFilePath, "w") self._StartTime = time.time() self._LastTimestamp = startTime rospy.Subscriber(self._OdomTopic, Odometry, self._onOdomMessageReceived)
Example #26
Source File: arduino (copy).py From ROS-Programming-Building-Powerful-Robots with MIT License | 5 votes |
def __init__(self, port="/dev/ttyUSB0", baudrate=115200): ''' 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') # rospy.logwarn("Init"); port = rospy.get_param("~port", "/dev/ttyACM0") baudRate = int(rospy.get_param("~baudRate", 115200)) rospy.loginfo("Starting with serial port: " + port + ", baud rate: " + str(baudRate)) # subscriptions rospy.Subscriber("cmd_vel", Twist, self._HandleVelocityCommand) # Is this line or the below bad redundancy? rospy.Subscriber("cmd_vel_mux/input/teleop", Twist, self._HandleVelocityCommand) # IS this line or the above bad redundancy? self._SerialPublisher = rospy.Publisher('serial', String,queue_size=10) self._OdometryTransformBroadcaster = tf.TransformBroadcaster() self._OdometryPublisher = rospy.Publisher("odom", Odometry,queue_size=10) # 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) self._VoltageHighlimit = 12 self._VoltageLowlimit = 11
Example #27
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 #28
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 #29
Source File: camera_recorder.py From visual_foresight with MIT License | 5 votes |
def __init__(self, topic_data, opencv_tracking=False, save_videos=False): self._tracking_enabled, self._save_vides = opencv_tracking, save_videos self._latest_image = LatestObservation(self._tracking_enabled, self._save_vides) self._is_tracking = False if self._tracking_enabled: self.box_height = 80 self.bridge = CvBridge() self._is_first_status, self._status_sem = True, Semaphore(value=0) self._cam_height, self._cam_width = None, None self._last_hash, self._num_repeats = None, 0 if self._save_vides: self._buffers = [] self._saving = False self._topic_data = topic_data self._image_dtype = topic_data.dtype rospy.Subscriber(topic_data.name, Image_msg, self.store_latest_im) logging.getLogger('robot_logger').debug('downing sema on topic: {}'.format(topic_data.name)) self._status_sem.acquire() logging.getLogger('robot_logger').info("Cameras {} subscribed: stream is {}x{}".format(self._topic_data.name, self._cam_width, self._cam_height))
Example #30
Source File: control_util.py From visual_foresight with MIT License | 5 votes |
def __init__(self): self._cv = Condition() self._latest_eep = None self._eep_sub = rospy.Subscriber('/robot/limb/right/endpoint_state', EndpointState, self._state_listener)