|
Package Summary
Tags | No category tags. |
Version | 1.2.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/IntelLabs/scenario_execution.git |
VCS Type | git |
VCS Version | humble |
Last Updated | 2024-11-20 |
Dev Status | MAINTAINED |
CI status | No Continuous Integration |
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Intel Labs
Authors
- Intel Labs
Gazebo TF Publisher
The Gazebo TF Publisher searches for the frame id of the robot and publishes it to the global ROS tf topic if it is started without a namespace. The output Frame id has the following syntax: robot_name_base_link_gt
. It is expected that the the frames from the gazebo topic are in the following order: map --> robot_name --> base_link
. Per default base_frame_id:=base_link
.
To start the gazebo ground truth publisher run the following code with the appropriate gazebo pose topic:
ros2 launch gazebo_tf_publisher gazebo_tf_publisher_launch.py gz_pose_topic:=/world/name/dynamic_pose/info
To view the gazebo topic list run the following command:
ign topic -l
The previous command prints all the gazebo topics and among them the right pose topic and also the name of the robots present in the simulation.
To start the node in a specified ROS namespace, use use_namespace:=True namespace:=desired_namespace
.
Wiki Tutorials
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
geometry_msgs | |
tf2_msgs | |
py_trees_ros_interfaces |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
example_simulation | |
tb4_sim_scenario |
Launch files
Messages
Services
Plugins
Recent questions tagged gazebo_tf_publisher at Robotics Stack Exchange
|
Package Summary
Tags | No category tags. |
Version | 1.2.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/IntelLabs/scenario_execution.git |
VCS Type | git |
VCS Version | jazzy |
Last Updated | 2024-11-20 |
Dev Status | MAINTAINED |
CI status | No Continuous Integration |
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Intel Labs
Authors
- Intel Labs
Gazebo TF Publisher
The Gazebo TF Publisher searches for the frame id of the robot and publishes it to the global ROS tf topic if it is started without a namespace. The output Frame id has the following syntax: robot_name_base_link_gt
. It is expected that the the frames from the gazebo topic are in the following order: map --> robot_name --> base_link
. Per default base_frame_id:=base_link
.
To start the gazebo ground truth publisher run the following code with the appropriate gazebo pose topic:
ros2 launch gazebo_tf_publisher gazebo_tf_publisher_launch.py gz_pose_topic:=/world/name/dynamic_pose/info
To view the gazebo topic list run the following command:
ign topic -l
The previous command prints all the gazebo topics and among them the right pose topic and also the name of the robots present in the simulation.
To start the node in a specified ROS namespace, use use_namespace:=True namespace:=desired_namespace
.
Wiki Tutorials
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
geometry_msgs | |
tf2_msgs | |
py_trees_ros_interfaces |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
example_simulation | |
tb4_sim_scenario |