Main Page
Namespaces
Classes
Files
File List
File Members
ros
src
dummy_head.py
Go to the documentation of this file.
1
#!/usr/bin/env python
2
3
import
rospy
4
from
sensor_msgs.msg
import
JointState
5
6
def
talker
():
7
pub = rospy.Publisher(
'/joint_states'
, JointState, queue_size=1)
8
rospy.init_node(
'dummy_head'
)
9
while
not
rospy.is_shutdown():
10
msg = JointState()
11
msg.name = []
12
msg.name.append(
'head_axis_joint'
)
13
msg.position = []
14
msg.position.append(0)
15
# msg.position.append(-3.14)
16
pub.publish(msg)
17
rospy.sleep(0.1)
18
if
__name__ ==
'__main__'
:
19
try
:
20
talker
()
21
except
rospy.ROSInterruptException:
pass
22
dummy_head.talker
def talker()
Definition:
dummy_head.py:6
cob_head_axis
Author(s): Ulrich Reiser
autogenerated on Tue Jul 25 2017 02:22:10