Skip to content
Snippets Groups Projects
Commit 3c2adfa5 authored by Daniel Christoph's avatar Daniel Christoph
Browse files

Update Simulation/location_monitor/scripts/location_monitor_node.py

parent b2701102
No related merge requests found
......@@ -5,11 +5,9 @@ import rospy
from nav_msgs.msg import Odometry
ob = []
ob.append((0.00 , -0.70)); #Beispeiele, befinden sich auf der X Linie
ob.append((0.00 , 0.00));
ob.append((0.00 , 0.80));
def distance(x1, y1, x2, y2):
xd = x1 - x2
......@@ -24,7 +22,7 @@ def callback(msg):
for l_x, l_y in ob:
dist = distance(x, y, l_x, l_y)
if dist < 0.20:
if dist < 0.20: #muss individuell angepasst wreden
rospy.loginfo("Collision!")
......
0% or .
You are about to add 0 people to the discussion. Proceed with caution.
Finish editing this message first!
Please register or to comment