Skip to content

Commit

Permalink
minor reformatting
Browse files Browse the repository at this point in the history
  • Loading branch information
Marius-Juston committed Jul 13, 2021
1 parent ca6c49f commit 7a38e8a
Show file tree
Hide file tree
Showing 9 changed files with 11 additions and 8 deletions.
6 changes: 2 additions & 4 deletions src/csv_creator.py
Original file line number Diff line number Diff line change
@@ -1,15 +1,13 @@
#! /usr/bin/env python
# coding=utf-8

import csv

import rospy
from gtec_msgs.msg import Ranging
from nav_msgs.msg import Odometry
from tf.transformations import euler_from_quaternion, euler_from_quaternion
from tf.transformations import euler_from_quaternion
from visualization_msgs.msg import MarkerArray

from ukf.datapoint import DataType, DataPoint
from ukf.datapoint import DataType


class Recorder(object):
Expand Down
2 changes: 1 addition & 1 deletion src/jackal.py
Original file line number Diff line number Diff line change
Expand Up @@ -335,7 +335,7 @@ def step(self):
will, thus transforming its odometry data from a local reference field to a global field. Once that is done it
toggles its tag and defines itself as being localized and uses an UKF to continue refining the measurement noise.
"""

if self.is_localized or self.time_override:
self.loc.step()
self.start_time = None
Expand Down
1 change: 1 addition & 0 deletions src/jackal_motion.py
Original file line number Diff line number Diff line change
Expand Up @@ -9,6 +9,7 @@ class JackalMotion(object):
"""
Class meant to publish to the Jackal motion commands
"""

def __init__(self, namespace):
"""
Setups publisher helper. Publishes to <namespace>jackal_velocity_controller/cmd_vel
Expand Down
3 changes: 2 additions & 1 deletion src/live_plotter.py
Original file line number Diff line number Diff line change
Expand Up @@ -10,7 +10,8 @@ class LivePlotter(object):
A helper class for creating live plotting matplotlib windows
"""

def __init__(self, update_interval=1000, alpha=1.0, window_name=None, time_removal=None, lengend_loc='best', font_size=None):
def __init__(self, update_interval=1000, alpha=1.0, window_name=None, time_removal=None, lengend_loc='best',
font_size=None):
"""
Setups the live plotting window
@param update_interval: How fast the animated window updates its values
Expand Down
1 change: 1 addition & 0 deletions src/location_drawer.py
Original file line number Diff line number Diff line change
Expand Up @@ -59,6 +59,7 @@ def create_position_subscriber_func(self, name):
@param name: Name of the topic name
@return: return the custom pose addition software
"""

def add_pose(msg):
# type: (Odometry) -> None
"""
Expand Down
2 changes: 1 addition & 1 deletion src/range_drawer.py
Original file line number Diff line number Diff line change
Expand Up @@ -6,7 +6,6 @@
matplotlib.use('Qt5Agg')

import rospy
import matplotlib.pyplot as plt
from gtec_msgs.msg import Ranging
from live_plotter import LivePlotter
import sys
Expand All @@ -16,6 +15,7 @@ class RangePlotter(object):
"""
A class to help plot the UWB range data
"""

def __init__(self, tags=None, n=-1):
"""
Setups the RangePLotter class
Expand Down
1 change: 1 addition & 0 deletions src/rsme_plotter.py
Original file line number Diff line number Diff line change
Expand Up @@ -17,6 +17,7 @@ class RSMEPlotter(object):
Do not use as it is not finished.
Class is meant to plot the RSME of the robot estimate position in live
"""

def __init__(self, target, actual):
"""
Setups the RMSE live plotter
Expand Down
1 change: 1 addition & 0 deletions src/ukf/datapoint.py
Original file line number Diff line number Diff line change
Expand Up @@ -14,6 +14,7 @@ class DataPoint(object):
"""
A class meant to represent a data point to pass into the position estimation system
"""

def __init__(self, data_type, measurement_data, timestamp, extra=None):
"""
Setups the DataPoint object
Expand Down
2 changes: 1 addition & 1 deletion src/ukf_uwb_localization.py
Original file line number Diff line number Diff line change
Expand Up @@ -175,7 +175,7 @@ def is_localized(self, robot_name):
parameter_name = robot_name + "is_localized"

if rospy.has_param(parameter_name):
return rospy.get_param(parameter_name)
return rospy.get_param(parameter_name)
else:
return True

Expand Down

0 comments on commit 7a38e8a

Please sign in to comment.