Skip to content

Commit

Permalink
pylint
Browse files Browse the repository at this point in the history
  • Loading branch information
mehulgoel873 committed May 15, 2024
1 parent 06bcbda commit aa33784
Showing 1 changed file with 4 additions and 3 deletions.
7 changes: 4 additions & 3 deletions rb_ws/src/buggy/scripts/serial/ros_to_bnyahaj.py
Original file line number Diff line number Diff line change
Expand Up @@ -3,14 +3,15 @@
import threading
from threading import Lock

import rospy
import argparse
import sys

#Allows import of world and pose from auton directory
sys.path.append("/rb_ws/src/buggy/scripts/auton")
from world import World
from pose import Pose

import argparse
import rospy

#Ros Message Imports
from std_msgs.msg import Float64, Bool, Int8, UInt8
Expand Down Expand Up @@ -55,7 +56,7 @@ def __init__(self, self_name, other_name, teensy_name):
self.odom_publisher = rospy.Publisher(self_name + "/nav/odom", ROSOdom, queue_size=1)
else:
self.odom_publisher = rospy.Publisher(other_name + "/nav/odom", ROSOdom, queue_size=1)

# upper bound of steering update rate, make sure auton sends slower than 500 Hz or update / 2ms
self.steer_send_rate = rospy.Rate(500)
# upper bound of reading data from Bnyahaj Serial, at 1ms
Expand Down

0 comments on commit aa33784

Please sign in to comment.