ros / geometry

Packages for common geometric calculations including the ROS transform library, "tf". Also includes ROS bindings for "bullet" physics engine and "kdl" kinematics/dynamics package.
173 stars 275 forks source link

Support roslaunch parameters in static_transform_publisher #110

Open orzechow opened 9 years ago

orzechow commented 9 years ago

eg. to enable using already loaded parameters as arguments:

<node pkg="tf" type="static_transform_publisher" name="static_tf_broadcaster1" respawn="true" >
  <remap from="~/x" to="/foo/bar"/>
  <param name="y" type="double" value="0.0" />
  <param name="z" type="double" value="0.0" />
  <param name="frame_id" type="string" value="link1_parent" />
  <param name="child_frame_id" type="string" value="link1" />
  <param name="period" type="double" value="100" />
  <param name="yaw" type="double" value="0.0" />
  <param name="pitch" type="double" value="0.0" />
  <param name="roll" type="double" value="0.0" />
</node>
tfoote commented 9 years ago

Thanks this looks good overall. If we're revisiting this command I'd like to make the same changes to https://github.com/ros/geometry_experimental/blob/jade-devel/tf2_ros/src/static_transform_broadcaster_program.cpp and possibly reuse the functionality from that program here as that approach is much lower bandwidth.

orzechow commented 9 years ago

Sure! I didn't know which package to choose, so decided for tf. But this change fits to both obviously.

Am 06.11.2015 um 00:11 schrieb Tully Foote notifications@github.com:

Thanks this looks good overall. If we're revisiting this command I'd like to make the same changes to https://github.com/ros/geometry_experimental/blob/jade-devel/tf2_ros/src/static_transform_broadcaster_program.cpp and possibly reuse the functionality from that program here as that approach is much lower bandwidth.

— Reply to this email directly or view it on GitHub.

tfoote commented 7 years ago

@ros-pull-request-builder retest this please

tfoote commented 7 years ago

@ros-pull-request-builder retest this please