Main Page
Namespaces
Files
File List
File Members
scripts
ros_controller.py
Go to the documentation of this file.
1
#!/usr/bin/env python
2
3
# Copyright 1996-2020 Cyberbotics Ltd.
4
#
5
# Licensed under the Apache License, Version 2.0 (the "License");
6
# you may not use this file except in compliance with the License.
7
# You may obtain a copy of the License at
8
#
9
# http://www.apache.org/licenses/LICENSE-2.0
10
#
11
# Unless required by applicable law or agreed to in writing, software
12
# distributed under the License is distributed on an "AS IS" BASIS,
13
# WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
14
# See the License for the specific language governing permissions and
15
# limitations under the License.
16
17
"""
18
This is a simple example of a Python ROS node receiving sensor values and publishing motor commands (velocity)
19
to drive a robot and stop it before colliding with an obstacle.
20
"""
21
22
import
rospy
23
from
std_msgs.msg
import
Float64
24
25
26
def
callback
(data):
27
global
pub
28
rospy.loginfo(rospy.get_caller_id() +
'Received sensor value: %s'
, data.data)
29
if
data.data > 100:
30
pub.publish(0)
31
else
:
32
pub.publish(9)
33
34
35
rospy.init_node(
'controller'
, anonymous=
True
)
36
pub = rospy.Publisher(
'motor'
, Float64, queue_size=10)
37
rospy.Subscriber(
"sensor"
, Float64, callback)
38
rospy.spin()
ros_controller.callback
def callback(data)
Definition:
ros_controller.py:26
webots_ros
Author(s): Cyberbotics
autogenerated on Fri Sep 4 2020 03:55:03