From 3c8ee2f714db80a3bb990a6bf2d40fe3bf0e58fb Mon Sep 17 00:00:00 2001 From: Mike Lautman <mikeblautman@github.com> Date: Thu, 21 Mar 2019 21:01:35 -0600 Subject: [PATCH] virtual joint quaternion->rpy --- launch/demo.launch | 2 +- 1 file changed, 1 insertion(+), 1 deletion(-) diff --git a/launch/demo.launch b/launch/demo.launch index 61544a0..34390a5 100644 --- a/launch/demo.launch +++ b/launch/demo.launch @@ -25,7 +25,7 @@ </include> <!-- If needed, broadcast static tf for robot root --> - <node pkg="tf2_ros" type="static_transform_publisher" name="virtual_joint_broadcaster_1" args="0 0 0 0 0 0 1 world panda_link0" /> + <node pkg="tf2_ros" type="static_transform_publisher" name="virtual_joint_broadcaster_1" args="0 0 0 0 0 0 world panda_link0" /> <!-- We do not have a robot connected, so publish fake joint states --> <node name="joint_state_publisher" pkg="joint_state_publisher" type="joint_state_publisher"> -- GitLab