Main Page
Namespaces
Files
File List
scripts
fake_joint_pub.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
rospy.init_node(
"fake_joint_pub"
)
7
p = rospy.Publisher(
'joint_states'
, JointState, queue_size=5)
8
9
msg = JointState()
10
msg.name = [
"gripper_link_joint"
]
11
msg.position = [0.0
for
name
in
msg.name]
12
msg.velocity = [0.0
for
name
in
msg.name]
13
14
while
not
rospy.is_shutdown():
15
msg.header.stamp = rospy.Time.now()
16
p.publish(msg)
17
rospy.sleep(0.05)
18
turtlebot_arm_bringup
Author(s): Michael Ferguson, Helen Oleynikova, Melonee Wise
autogenerated on Fri Feb 7 2020 03:56:23