Skip to content

Commit

Permalink
Fix pylint complaints
Browse files Browse the repository at this point in the history
  • Loading branch information
PatXue committed Feb 15, 2024
1 parent a12d373 commit 967bcc4
Showing 1 changed file with 4 additions and 5 deletions.
9 changes: 4 additions & 5 deletions rb_ws/src/buggy/scripts/2d_sim/engine.py
Original file line number Diff line number Diff line change
@@ -1,14 +1,13 @@
#! /usr/bin/env python3
import sys
import threading
import rospy
from geometry_msgs.msg import Pose, Twist, PoseWithCovariance, TwistWithCovariance
from std_msgs.msg import Float64
from sensor_msgs.msg import NavSatFix
from nav_msgs.msg import Odometry
import threading
import numpy as np
import utm
import time
import sys


class Simulator:
Expand Down Expand Up @@ -69,7 +68,7 @@ def __init__(self, starting_pose, velocity, buggy_name):
# self.e_utm = utm_coords[0]
# self.n_utm = utm_coords[1]

self.e_utm, self.n_utm, self.heading = self.starting_poses[starting_pose]
self.e_utm, self.n_utm, self.heading = self.starting_poses[starting_pose]
self.velocity = velocity # m/s

self.steering_angle = 0 # degrees
Expand Down Expand Up @@ -121,7 +120,7 @@ def dynamics(self, state, v):
dstate (np.Array): time derivative of state from dynamics
"""
l = Simulator.WHEELBASE
x, y, theta, delta = state
_, _, theta, delta = state

return np.array([v * np.cos(theta),
v * np.sin(theta),
Expand Down

0 comments on commit 967bcc4

Please sign in to comment.