├── .gitignore ├── CONTRIBUTING.md ├── README.md ├── SENSORS.md ├── gazebo_dev ├── CHANGELOG.rst ├── CMakeLists.txt ├── cmake │ └── gazebo_dev-extras.cmake ├── colcon.pkg └── package.xml ├── gazebo_msgs ├── CHANGELOG.rst ├── CMakeLists.txt ├── msg │ ├── ContactState.msg │ ├── ContactsState.msg │ ├── LinkState.msg │ ├── LinkStates.msg │ ├── ModelState.msg │ ├── ModelStates.msg │ ├── ODEJointProperties.msg │ ├── ODEPhysics.msg │ ├── PerformanceMetrics.msg │ ├── SensorPerformanceMetric.msg │ └── WorldState.msg ├── package.xml └── srv │ ├── ApplyBodyWrench.srv │ ├── ApplyJointEffort.srv │ ├── BodyRequest.srv │ ├── DeleteLight.srv │ ├── DeleteModel.srv │ ├── GetJointProperties.srv │ ├── GetLightProperties.srv │ ├── GetLinkProperties.srv │ ├── GetLinkState.srv │ ├── GetModelProperties.srv │ ├── GetModelState.srv │ ├── GetPhysicsProperties.srv │ ├── GetWorldProperties.srv │ ├── JointRequest.srv │ ├── SetJointProperties.srv │ ├── SetJointTrajectory.srv │ ├── SetLightProperties.srv │ ├── SetLinkProperties.srv │ ├── SetLinkState.srv │ ├── SetModelConfiguration.srv │ ├── SetModelState.srv │ ├── SetPhysicsProperties.srv │ └── SpawnModel.srv ├── gazebo_plugins ├── CHANGELOG.rst ├── CMakeLists.txt ├── Media │ └── models │ │ └── chair │ │ ├── doc.kml │ │ ├── images │ │ ├── texture0.jpg │ │ └── texture1.jpg │ │ ├── models │ │ ├── Chair.dae │ │ └── Chair.stl │ │ └── textures.txt ├── cfg │ ├── CameraSynchronizer.cfg │ ├── GazeboRosCamera.cfg │ ├── GazeboRosOpenniKinect.cfg │ ├── Hokuyo.cfg │ └── WheelSlip.cfg ├── colcon.pkg ├── include │ └── gazebo_plugins │ │ ├── MultiCameraPlugin.h │ │ ├── PubQueue.h │ │ ├── gazebo_ros_block_laser.h │ │ ├── gazebo_ros_bumper.h │ │ ├── gazebo_ros_camera.h │ │ ├── gazebo_ros_camera_utils.h │ │ ├── gazebo_ros_depth_camera.h │ │ ├── gazebo_ros_diff_drive.h │ │ ├── gazebo_ros_elevator.h │ │ ├── gazebo_ros_f3d.h │ │ ├── gazebo_ros_force.h │ │ ├── gazebo_ros_ft_sensor.h │ │ ├── gazebo_ros_gpu_laser.h │ │ ├── gazebo_ros_hand_of_god.h │ │ ├── gazebo_ros_harness.h │ │ ├── gazebo_ros_imu.h │ │ ├── gazebo_ros_imu_sensor.h │ │ ├── gazebo_ros_joint_pose_trajectory.h │ │ ├── gazebo_ros_joint_state_publisher.h │ │ ├── gazebo_ros_laser.h │ │ ├── gazebo_ros_multicamera.h │ │ ├── gazebo_ros_openni_kinect.h │ │ ├── gazebo_ros_p3d.h │ │ ├── gazebo_ros_planar_move.h │ │ ├── gazebo_ros_projector.h │ │ ├── gazebo_ros_prosilica.h │ │ ├── gazebo_ros_range.h │ │ ├── gazebo_ros_skid_steer_drive.h │ │ ├── gazebo_ros_template.h │ │ ├── gazebo_ros_tricycle_drive.h │ │ ├── gazebo_ros_triggered_camera.h │ │ ├── gazebo_ros_triggered_multicamera.h │ │ ├── gazebo_ros_utils.h │ │ ├── gazebo_ros_vacuum_gripper.h │ │ ├── gazebo_ros_video.h │ │ ├── gazebo_ros_wheel_slip.h │ │ └── vision_reconfigure.h ├── package.xml ├── scripts │ ├── gazebo_model │ ├── set_pose.py │ ├── set_wrench.py │ ├── test_block_laser_clipping.py │ └── test_range.py ├── setup.py ├── src │ ├── MultiCameraPlugin.cpp │ ├── camera_synchronizer.cpp │ ├── gazebo_plugins │ │ ├── __init__.py │ │ └── gazebo_plugins_interface.py │ ├── gazebo_ros_block_laser.cpp │ ├── gazebo_ros_bumper.cpp │ ├── gazebo_ros_camera.cpp │ ├── gazebo_ros_camera_utils.cpp │ ├── gazebo_ros_depth_camera.cpp │ ├── gazebo_ros_diff_drive.cpp │ ├── gazebo_ros_elevator.cpp │ ├── gazebo_ros_f3d.cpp │ ├── gazebo_ros_force.cpp │ ├── gazebo_ros_ft_sensor.cpp │ ├── gazebo_ros_gpu_laser.cpp │ ├── gazebo_ros_hand_of_god.cpp │ ├── gazebo_ros_harness.cpp │ ├── gazebo_ros_imu.cpp │ ├── gazebo_ros_imu_sensor.cpp │ ├── gazebo_ros_joint_pose_trajectory.cpp │ ├── gazebo_ros_joint_state_publisher.cpp │ ├── gazebo_ros_laser.cpp │ ├── gazebo_ros_multicamera.cpp │ ├── gazebo_ros_openni_kinect.cpp │ ├── gazebo_ros_p3d.cpp │ ├── gazebo_ros_planar_move.cpp │ ├── gazebo_ros_projector.cpp │ ├── gazebo_ros_prosilica.cpp │ ├── gazebo_ros_range.cpp │ ├── gazebo_ros_skid_steer_drive.cpp │ ├── gazebo_ros_template.cpp │ ├── gazebo_ros_tricycle_drive.cpp │ ├── gazebo_ros_triggered_camera.cpp │ ├── gazebo_ros_triggered_multicamera.cpp │ ├── gazebo_ros_utils.cpp │ ├── gazebo_ros_vacuum_gripper.cpp │ ├── gazebo_ros_video.cpp │ ├── gazebo_ros_wheel_slip.cpp │ ├── hokuyo_node.cpp │ └── vision_reconfigure.cpp ├── test │ ├── block_laser_clipping.test │ ├── bumper_test │ │ ├── gazebo_ros_bumper.world │ │ ├── test_bumper.launch │ │ └── test_bumper.py │ ├── camera │ │ ├── camera.cpp │ │ ├── camera.h │ │ ├── camera.test │ │ ├── camera.world │ │ ├── camera16bit.cpp │ │ ├── camera16bit.test │ │ ├── camera16bit.world │ │ ├── depth_camera.cpp │ │ ├── depth_camera.test │ │ ├── depth_camera.world │ │ ├── distortion.h │ │ ├── distortion_barrel.cpp │ │ ├── distortion_barrel.test │ │ ├── distortion_barrel.world │ │ ├── distortion_pincushion.cpp │ │ ├── distortion_pincushion.test │ │ ├── distortion_pincushion.world │ │ ├── multicamera.cpp │ │ ├── multicamera.test │ │ ├── multicamera.world │ │ ├── triggered_camera.cpp │ │ ├── triggered_camera.test │ │ └── triggered_camera.world │ ├── config │ │ └── example_models.yaml │ ├── multi_robot_scenario │ │ ├── launch │ │ │ ├── multi_robot_scenario.launch │ │ │ ├── pioneer3dx.gazebo.launch │ │ │ ├── pioneer3dx.rviz │ │ │ └── pioneer3dx.urdf.launch │ │ ├── meshes │ │ │ ├── laser │ │ │ │ └── hokuyo.dae │ │ │ └── p3dx │ │ │ │ ├── Coordinates │ │ │ │ ├── back_rim.stl │ │ │ │ ├── back_sonar.stl │ │ │ │ ├── center_hubcap.stl │ │ │ │ ├── center_wheel.stl │ │ │ │ ├── chassis.stl │ │ │ │ ├── front_rim.stl │ │ │ │ ├── front_sonar.stl │ │ │ │ ├── left_hubcap.stl │ │ │ │ ├── left_wheel.stl │ │ │ │ ├── right_hubcap.stl │ │ │ │ ├── right_wheel.stl │ │ │ │ ├── swivel.stl │ │ │ │ └── top.stl │ │ └── xacro │ │ │ ├── camera │ │ │ └── camera.xacro │ │ │ ├── laser │ │ │ ├── hokuyo.xacro │ │ │ └── hokuyo_gpu.xacro │ │ │ ├── materials.xacro │ │ │ └── p3dx │ │ │ ├── battery_block.xacro │ │ │ ├── inertia_tensors.xacro │ │ │ ├── pioneer3dx.xacro │ │ │ ├── pioneer3dx_body.xacro │ │ │ ├── pioneer3dx_chassis.xacro │ │ │ ├── pioneer3dx_plugins.xacro │ │ │ ├── pioneer3dx_sonar.xacro │ │ │ ├── pioneer3dx_swivel.xacro │ │ │ └── pioneer3dx_wheel.xacro │ ├── p3d_test │ │ ├── test_3_double_pendulums.launch │ │ ├── test_3_single_pendulums.launch │ │ ├── test_double_pendulum.launch │ │ ├── test_link_pose.py │ │ ├── test_single_pendulum.launch │ │ └── worlds │ │ │ ├── 3_double_pendulums.world │ │ │ ├── 3_single_pendulums.world │ │ │ ├── double_pendulum.world │ │ │ └── single_pendulum.world │ ├── pub_joint_trajectory_test.cpp │ ├── range │ │ └── range_plugin.test │ ├── set_model_state_test │ │ ├── set_model_state_test.cpp │ │ ├── set_model_state_test.test │ │ └── set_model_state_test_p2dx.world │ ├── spawn_test │ │ ├── parameter_server_test.launch │ │ └── spawn_robots.sh │ ├── test_worlds │ │ ├── bumper_test.world │ │ ├── elevator.world │ │ ├── gazebo_ros_block_laser.world │ │ ├── gazebo_ros_block_laser_clipping.world │ │ ├── gazebo_ros_camera.world │ │ ├── gazebo_ros_depth_camera.world │ │ ├── gazebo_ros_gpu_laser.world │ │ ├── gazebo_ros_laser.world │ │ ├── gazebo_ros_range.world │ │ ├── gazebo_ros_trimesh_collision.world │ │ ├── test_lasers.world │ │ └── trisphere_cycle_wheel_slip.world │ └── tricycle_drive │ │ ├── launch │ │ ├── .directory │ │ ├── tricycle.gazebo.launch │ │ ├── tricycle.rviz │ │ ├── tricycle.urdf.launch │ │ ├── tricycle_drive_scenario.launch │ │ └── tricycle_rviz.launch │ │ └── xacro │ │ ├── .directory │ │ ├── materials.xacro │ │ └── tricycle │ │ ├── inertia_tensors.xacro │ │ ├── tricycle.xacro │ │ ├── tricycle_body.xacro │ │ ├── tricycle_chassis.xacro │ │ ├── tricycle_plugins.xacro │ │ ├── wheel.xacro │ │ └── wheel_actuated.xacro └── test2 │ ├── CMakeLists_tests_pkg.txt │ ├── contact_tolerance │ ├── contact_tolerance.cpp │ └── contact_tolerance.launch │ ├── large_models │ ├── large_model.launch │ ├── large_model.urdf.xacro │ ├── large_models.world │ ├── smaller_large_model.launch │ └── smaller_large_model.urdf.xacro │ ├── lcp_tests │ ├── balance.launch │ ├── balance.world │ ├── stack.launch │ ├── stack.world │ ├── stacks.launch │ └── stacks.world │ ├── meshes │ ├── cube.wings │ ├── cube_20k.stl │ └── cube_30k.stl │ ├── spawn_model │ ├── check_model.cpp │ ├── spawn_box.cpp │ ├── spawn_box.launch │ ├── spawn_box_file.launch │ └── spawn_box_param.launch │ ├── trimesh_tests │ └── test_trimesh.launch │ ├── urdf │ ├── box.urdf │ └── cube.urdf │ └── worlds │ └── empty.world ├── gazebo_ros ├── .idea │ └── gazebo_ros.iml ├── CHANGELOG.rst ├── CMakeLists.txt ├── cfg │ └── Physics.cfg ├── colcon.pkg ├── include │ └── gazebo_ros │ │ └── gazebo_ros_api_plugin.h ├── launch │ ├── elevator_world.launch │ ├── empty_world.launch │ ├── mud_world.launch │ ├── range_world.launch │ ├── rubble_world.launch │ ├── shapes_world.launch │ └── willowgarage_world.launch ├── package.xml ├── scripts │ ├── debug │ ├── debug.bat │ ├── gazebo │ ├── gdbrun │ ├── gzclient │ ├── gzclient.bat │ ├── gzserver │ ├── gzserver.bat │ ├── libcommon.sh │ ├── perf │ └── spawn_model ├── setup.py ├── src │ ├── gazebo_ros │ │ ├── __init__.py │ │ └── gazebo_interface.py │ ├── gazebo_ros_api_plugin.cpp │ └── gazebo_ros_paths_plugin.cpp └── test │ ├── CMakeLists.txt │ └── ros_network │ ├── gazebo_network_api.yaml │ ├── no_gazebo_network_api.yaml │ ├── ros_api_checker │ ├── ros_network_default.test │ └── ros_network_disabled.test ├── gazebo_ros_control ├── CHANGELOG.rst ├── CMakeLists.txt ├── README.md ├── colcon.pkg ├── include │ └── gazebo_ros_control │ │ ├── default_robot_hw_sim.h │ │ ├── gazebo_ros_control_plugin.h │ │ └── robot_hw_sim.h ├── package.xml ├── robot_hw_sim_plugins.xml └── src │ ├── default_robot_hw_sim.cpp │ └── gazebo_ros_control_plugin.cpp └── gazebo_ros_pkgs ├── CHANGELOG.rst ├── CMakeLists.txt ├── documentation ├── gazebo_ros_api.odg ├── gazebo_ros_api.pdf ├── gazebo_ros_api.png ├── gazebo_ros_transmission.odg ├── gazebo_ros_transmission.pdf └── gazebo_ros_transmission.png └── package.xml /.gitignore: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/.gitignore -------------------------------------------------------------------------------- /CONTRIBUTING.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/CONTRIBUTING.md -------------------------------------------------------------------------------- /README.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/README.md -------------------------------------------------------------------------------- /SENSORS.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/SENSORS.md -------------------------------------------------------------------------------- /gazebo_dev/CHANGELOG.rst: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_dev/CHANGELOG.rst -------------------------------------------------------------------------------- /gazebo_dev/CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_dev/CMakeLists.txt -------------------------------------------------------------------------------- /gazebo_dev/cmake/gazebo_dev-extras.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_dev/cmake/gazebo_dev-extras.cmake -------------------------------------------------------------------------------- /gazebo_dev/colcon.pkg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_dev/colcon.pkg -------------------------------------------------------------------------------- /gazebo_dev/package.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_dev/package.xml -------------------------------------------------------------------------------- /gazebo_msgs/CHANGELOG.rst: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/CHANGELOG.rst -------------------------------------------------------------------------------- /gazebo_msgs/CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/CMakeLists.txt -------------------------------------------------------------------------------- /gazebo_msgs/msg/ContactState.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/ContactState.msg -------------------------------------------------------------------------------- /gazebo_msgs/msg/ContactsState.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/ContactsState.msg -------------------------------------------------------------------------------- /gazebo_msgs/msg/LinkState.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/LinkState.msg -------------------------------------------------------------------------------- /gazebo_msgs/msg/LinkStates.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/LinkStates.msg -------------------------------------------------------------------------------- /gazebo_msgs/msg/ModelState.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/ModelState.msg -------------------------------------------------------------------------------- /gazebo_msgs/msg/ModelStates.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/ModelStates.msg -------------------------------------------------------------------------------- /gazebo_msgs/msg/ODEJointProperties.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/ODEJointProperties.msg -------------------------------------------------------------------------------- /gazebo_msgs/msg/ODEPhysics.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/ODEPhysics.msg -------------------------------------------------------------------------------- /gazebo_msgs/msg/PerformanceMetrics.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/PerformanceMetrics.msg -------------------------------------------------------------------------------- /gazebo_msgs/msg/SensorPerformanceMetric.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/SensorPerformanceMetric.msg -------------------------------------------------------------------------------- /gazebo_msgs/msg/WorldState.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/msg/WorldState.msg -------------------------------------------------------------------------------- /gazebo_msgs/package.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/package.xml -------------------------------------------------------------------------------- /gazebo_msgs/srv/ApplyBodyWrench.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/ApplyBodyWrench.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/ApplyJointEffort.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/ApplyJointEffort.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/BodyRequest.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/BodyRequest.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/DeleteLight.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/DeleteLight.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/DeleteModel.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/DeleteModel.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/GetJointProperties.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/GetJointProperties.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/GetLightProperties.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/GetLightProperties.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/GetLinkProperties.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/GetLinkProperties.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/GetLinkState.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/GetLinkState.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/GetModelProperties.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/GetModelProperties.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/GetModelState.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/GetModelState.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/GetPhysicsProperties.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/GetPhysicsProperties.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/GetWorldProperties.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/GetWorldProperties.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/JointRequest.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/JointRequest.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/SetJointProperties.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/SetJointProperties.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/SetJointTrajectory.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/SetJointTrajectory.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/SetLightProperties.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/SetLightProperties.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/SetLinkProperties.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/SetLinkProperties.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/SetLinkState.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/SetLinkState.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/SetModelConfiguration.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/SetModelConfiguration.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/SetModelState.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/SetModelState.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/SetPhysicsProperties.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/SetPhysicsProperties.srv -------------------------------------------------------------------------------- /gazebo_msgs/srv/SpawnModel.srv: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_msgs/srv/SpawnModel.srv -------------------------------------------------------------------------------- /gazebo_plugins/CHANGELOG.rst: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/CHANGELOG.rst -------------------------------------------------------------------------------- /gazebo_plugins/CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/CMakeLists.txt -------------------------------------------------------------------------------- /gazebo_plugins/Media/models/chair/doc.kml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/Media/models/chair/doc.kml -------------------------------------------------------------------------------- /gazebo_plugins/Media/models/chair/images/texture0.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/Media/models/chair/images/texture0.jpg -------------------------------------------------------------------------------- /gazebo_plugins/Media/models/chair/images/texture1.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/Media/models/chair/images/texture1.jpg -------------------------------------------------------------------------------- /gazebo_plugins/Media/models/chair/models/Chair.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/Media/models/chair/models/Chair.dae -------------------------------------------------------------------------------- /gazebo_plugins/Media/models/chair/models/Chair.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/Media/models/chair/models/Chair.stl -------------------------------------------------------------------------------- /gazebo_plugins/Media/models/chair/textures.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/Media/models/chair/textures.txt -------------------------------------------------------------------------------- /gazebo_plugins/cfg/CameraSynchronizer.cfg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/cfg/CameraSynchronizer.cfg -------------------------------------------------------------------------------- /gazebo_plugins/cfg/GazeboRosCamera.cfg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/cfg/GazeboRosCamera.cfg -------------------------------------------------------------------------------- /gazebo_plugins/cfg/GazeboRosOpenniKinect.cfg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/cfg/GazeboRosOpenniKinect.cfg -------------------------------------------------------------------------------- /gazebo_plugins/cfg/Hokuyo.cfg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/cfg/Hokuyo.cfg -------------------------------------------------------------------------------- /gazebo_plugins/cfg/WheelSlip.cfg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/cfg/WheelSlip.cfg -------------------------------------------------------------------------------- /gazebo_plugins/colcon.pkg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/colcon.pkg -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/MultiCameraPlugin.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/MultiCameraPlugin.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/PubQueue.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/PubQueue.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_block_laser.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_block_laser.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_bumper.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_bumper.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_camera.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_camera.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_camera_utils.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_camera_utils.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_depth_camera.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_depth_camera.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_diff_drive.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_diff_drive.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_elevator.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_elevator.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_f3d.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_f3d.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_force.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_force.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_ft_sensor.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_ft_sensor.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_gpu_laser.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_gpu_laser.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_hand_of_god.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_hand_of_god.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_harness.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_harness.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_imu.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_imu.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_imu_sensor.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_imu_sensor.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_joint_pose_trajectory.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_joint_pose_trajectory.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_joint_state_publisher.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_joint_state_publisher.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_laser.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_laser.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_multicamera.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_multicamera.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_openni_kinect.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_openni_kinect.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_p3d.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_p3d.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_planar_move.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_planar_move.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_projector.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_projector.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_prosilica.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_prosilica.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_range.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_range.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_skid_steer_drive.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_skid_steer_drive.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_template.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_template.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_tricycle_drive.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_tricycle_drive.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_triggered_camera.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_triggered_camera.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_triggered_multicamera.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_triggered_multicamera.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_utils.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_utils.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_vacuum_gripper.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_vacuum_gripper.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_video.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_video.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/gazebo_ros_wheel_slip.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/gazebo_ros_wheel_slip.h -------------------------------------------------------------------------------- /gazebo_plugins/include/gazebo_plugins/vision_reconfigure.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/include/gazebo_plugins/vision_reconfigure.h -------------------------------------------------------------------------------- /gazebo_plugins/package.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/package.xml -------------------------------------------------------------------------------- /gazebo_plugins/scripts/gazebo_model: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/scripts/gazebo_model -------------------------------------------------------------------------------- /gazebo_plugins/scripts/set_pose.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/scripts/set_pose.py -------------------------------------------------------------------------------- /gazebo_plugins/scripts/set_wrench.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/scripts/set_wrench.py -------------------------------------------------------------------------------- /gazebo_plugins/scripts/test_block_laser_clipping.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/scripts/test_block_laser_clipping.py -------------------------------------------------------------------------------- /gazebo_plugins/scripts/test_range.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/scripts/test_range.py -------------------------------------------------------------------------------- /gazebo_plugins/setup.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/setup.py -------------------------------------------------------------------------------- /gazebo_plugins/src/MultiCameraPlugin.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/MultiCameraPlugin.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/camera_synchronizer.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/camera_synchronizer.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_plugins/__init__.py: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_plugins/gazebo_plugins_interface.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_plugins/gazebo_plugins_interface.py -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_block_laser.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_block_laser.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_bumper.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_bumper.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_camera.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_camera.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_camera_utils.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_camera_utils.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_depth_camera.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_depth_camera.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_diff_drive.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_diff_drive.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_elevator.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_elevator.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_f3d.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_f3d.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_force.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_force.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_ft_sensor.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_ft_sensor.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_gpu_laser.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_gpu_laser.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_hand_of_god.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_hand_of_god.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_harness.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_harness.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_imu.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_imu.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_imu_sensor.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_imu_sensor.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_joint_pose_trajectory.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_joint_pose_trajectory.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_joint_state_publisher.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_joint_state_publisher.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_laser.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_laser.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_multicamera.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_multicamera.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_openni_kinect.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_openni_kinect.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_p3d.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_p3d.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_planar_move.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_planar_move.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_projector.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_projector.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_prosilica.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_prosilica.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_range.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_range.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_skid_steer_drive.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_skid_steer_drive.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_template.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_template.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_tricycle_drive.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_tricycle_drive.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_triggered_camera.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_triggered_camera.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_triggered_multicamera.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_triggered_multicamera.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_utils.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_utils.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_vacuum_gripper.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_vacuum_gripper.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_video.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_video.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/gazebo_ros_wheel_slip.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/gazebo_ros_wheel_slip.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/hokuyo_node.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/hokuyo_node.cpp -------------------------------------------------------------------------------- /gazebo_plugins/src/vision_reconfigure.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/src/vision_reconfigure.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test/block_laser_clipping.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/block_laser_clipping.test -------------------------------------------------------------------------------- /gazebo_plugins/test/bumper_test/gazebo_ros_bumper.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/bumper_test/gazebo_ros_bumper.world -------------------------------------------------------------------------------- /gazebo_plugins/test/bumper_test/test_bumper.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/bumper_test/test_bumper.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/bumper_test/test_bumper.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/bumper_test/test_bumper.py -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/camera.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/camera.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/camera.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/camera.h -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/camera.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/camera.test -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/camera.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/camera.world -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/camera16bit.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/camera16bit.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/camera16bit.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/camera16bit.test -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/camera16bit.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/camera16bit.world -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/depth_camera.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/depth_camera.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/depth_camera.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/depth_camera.test -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/depth_camera.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/depth_camera.world -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/distortion.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/distortion.h -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/distortion_barrel.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/distortion_barrel.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/distortion_barrel.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/distortion_barrel.test -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/distortion_barrel.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/distortion_barrel.world -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/distortion_pincushion.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/distortion_pincushion.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/distortion_pincushion.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/distortion_pincushion.test -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/distortion_pincushion.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/distortion_pincushion.world -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/multicamera.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/multicamera.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/multicamera.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/multicamera.test -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/multicamera.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/multicamera.world -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/triggered_camera.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/triggered_camera.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/triggered_camera.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/triggered_camera.test -------------------------------------------------------------------------------- /gazebo_plugins/test/camera/triggered_camera.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/camera/triggered_camera.world -------------------------------------------------------------------------------- /gazebo_plugins/test/config/example_models.yaml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/config/example_models.yaml -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/launch/multi_robot_scenario.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/launch/multi_robot_scenario.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/launch/pioneer3dx.gazebo.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/launch/pioneer3dx.gazebo.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/launch/pioneer3dx.rviz: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/launch/pioneer3dx.rviz -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/launch/pioneer3dx.urdf.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/launch/pioneer3dx.urdf.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/laser/hokuyo.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/laser/hokuyo.dae -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/Coordinates: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/Coordinates -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/back_rim.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/back_rim.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/back_sonar.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/back_sonar.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/center_hubcap.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/center_hubcap.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/center_wheel.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/center_wheel.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/chassis.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/chassis.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/front_rim.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/front_rim.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/front_sonar.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/front_sonar.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/left_hubcap.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/left_hubcap.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/left_wheel.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/left_wheel.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/right_hubcap.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/right_hubcap.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/right_wheel.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/right_wheel.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/swivel.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/swivel.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/top.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/meshes/p3dx/top.stl -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/camera/camera.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/camera/camera.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/laser/hokuyo.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/laser/hokuyo.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/laser/hokuyo_gpu.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/laser/hokuyo_gpu.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/materials.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/materials.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/battery_block.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/battery_block.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/inertia_tensors.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/inertia_tensors.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_body.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_body.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_chassis.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_chassis.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_plugins.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_plugins.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_sonar.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_sonar.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_swivel.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_swivel.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_wheel.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/multi_robot_scenario/xacro/p3dx/pioneer3dx_wheel.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/p3d_test/test_3_double_pendulums.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/p3d_test/test_3_double_pendulums.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/p3d_test/test_3_single_pendulums.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/p3d_test/test_3_single_pendulums.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/p3d_test/test_double_pendulum.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/p3d_test/test_double_pendulum.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/p3d_test/test_link_pose.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/p3d_test/test_link_pose.py -------------------------------------------------------------------------------- /gazebo_plugins/test/p3d_test/test_single_pendulum.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/p3d_test/test_single_pendulum.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/p3d_test/worlds/3_double_pendulums.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/p3d_test/worlds/3_double_pendulums.world -------------------------------------------------------------------------------- /gazebo_plugins/test/p3d_test/worlds/3_single_pendulums.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/p3d_test/worlds/3_single_pendulums.world -------------------------------------------------------------------------------- /gazebo_plugins/test/p3d_test/worlds/double_pendulum.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/p3d_test/worlds/double_pendulum.world -------------------------------------------------------------------------------- /gazebo_plugins/test/p3d_test/worlds/single_pendulum.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/p3d_test/worlds/single_pendulum.world -------------------------------------------------------------------------------- /gazebo_plugins/test/pub_joint_trajectory_test.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/pub_joint_trajectory_test.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test/range/range_plugin.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/range/range_plugin.test -------------------------------------------------------------------------------- /gazebo_plugins/test/set_model_state_test/set_model_state_test.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/set_model_state_test/set_model_state_test.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test/set_model_state_test/set_model_state_test.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/set_model_state_test/set_model_state_test.test -------------------------------------------------------------------------------- /gazebo_plugins/test/set_model_state_test/set_model_state_test_p2dx.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/set_model_state_test/set_model_state_test_p2dx.world -------------------------------------------------------------------------------- /gazebo_plugins/test/spawn_test/parameter_server_test.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/spawn_test/parameter_server_test.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/spawn_test/spawn_robots.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/spawn_test/spawn_robots.sh -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/bumper_test.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/bumper_test.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/elevator.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/elevator.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/gazebo_ros_block_laser.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/gazebo_ros_block_laser.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/gazebo_ros_block_laser_clipping.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/gazebo_ros_block_laser_clipping.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/gazebo_ros_camera.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/gazebo_ros_camera.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/gazebo_ros_depth_camera.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/gazebo_ros_depth_camera.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/gazebo_ros_gpu_laser.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/gazebo_ros_gpu_laser.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/gazebo_ros_laser.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/gazebo_ros_laser.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/gazebo_ros_range.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/gazebo_ros_range.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/gazebo_ros_trimesh_collision.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/gazebo_ros_trimesh_collision.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/test_lasers.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/test_lasers.world -------------------------------------------------------------------------------- /gazebo_plugins/test/test_worlds/trisphere_cycle_wheel_slip.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/test_worlds/trisphere_cycle_wheel_slip.world -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/launch/.directory: -------------------------------------------------------------------------------- 1 | [Dolphin] 2 | Timestamp=2013,11,4,9,14,4 3 | Version=3 4 | ViewMode=2 5 | -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/launch/tricycle.gazebo.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/launch/tricycle.gazebo.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/launch/tricycle.rviz: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/launch/tricycle.rviz -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/launch/tricycle.urdf.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/launch/tricycle.urdf.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/launch/tricycle_drive_scenario.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/launch/tricycle_drive_scenario.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/launch/tricycle_rviz.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/launch/tricycle_rviz.launch -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/xacro/.directory: -------------------------------------------------------------------------------- 1 | [Dolphin] 2 | Timestamp=2013,10,18,16,23,17 3 | ViewMode=2 4 | -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/xacro/materials.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/xacro/materials.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/xacro/tricycle/inertia_tensors.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/xacro/tricycle/inertia_tensors.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/xacro/tricycle/tricycle.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/xacro/tricycle/tricycle.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/xacro/tricycle/tricycle_body.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/xacro/tricycle/tricycle_body.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/xacro/tricycle/tricycle_chassis.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/xacro/tricycle/tricycle_chassis.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/xacro/tricycle/tricycle_plugins.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/xacro/tricycle/tricycle_plugins.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/xacro/tricycle/wheel.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/xacro/tricycle/wheel.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test/tricycle_drive/xacro/tricycle/wheel_actuated.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test/tricycle_drive/xacro/tricycle/wheel_actuated.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test2/CMakeLists_tests_pkg.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/CMakeLists_tests_pkg.txt -------------------------------------------------------------------------------- /gazebo_plugins/test2/contact_tolerance/contact_tolerance.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/contact_tolerance/contact_tolerance.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test2/contact_tolerance/contact_tolerance.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/contact_tolerance/contact_tolerance.launch -------------------------------------------------------------------------------- /gazebo_plugins/test2/large_models/large_model.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/large_models/large_model.launch -------------------------------------------------------------------------------- /gazebo_plugins/test2/large_models/large_model.urdf.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/large_models/large_model.urdf.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test2/large_models/large_models.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/large_models/large_models.world -------------------------------------------------------------------------------- /gazebo_plugins/test2/large_models/smaller_large_model.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/large_models/smaller_large_model.launch -------------------------------------------------------------------------------- /gazebo_plugins/test2/large_models/smaller_large_model.urdf.xacro: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/large_models/smaller_large_model.urdf.xacro -------------------------------------------------------------------------------- /gazebo_plugins/test2/lcp_tests/balance.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/lcp_tests/balance.launch -------------------------------------------------------------------------------- /gazebo_plugins/test2/lcp_tests/balance.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/lcp_tests/balance.world -------------------------------------------------------------------------------- /gazebo_plugins/test2/lcp_tests/stack.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/lcp_tests/stack.launch -------------------------------------------------------------------------------- /gazebo_plugins/test2/lcp_tests/stack.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/lcp_tests/stack.world -------------------------------------------------------------------------------- /gazebo_plugins/test2/lcp_tests/stacks.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/lcp_tests/stacks.launch -------------------------------------------------------------------------------- /gazebo_plugins/test2/lcp_tests/stacks.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/lcp_tests/stacks.world -------------------------------------------------------------------------------- /gazebo_plugins/test2/meshes/cube.wings: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/meshes/cube.wings -------------------------------------------------------------------------------- /gazebo_plugins/test2/meshes/cube_20k.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/meshes/cube_20k.stl -------------------------------------------------------------------------------- /gazebo_plugins/test2/meshes/cube_30k.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/meshes/cube_30k.stl -------------------------------------------------------------------------------- /gazebo_plugins/test2/spawn_model/check_model.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/spawn_model/check_model.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test2/spawn_model/spawn_box.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/spawn_model/spawn_box.cpp -------------------------------------------------------------------------------- /gazebo_plugins/test2/spawn_model/spawn_box.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/spawn_model/spawn_box.launch -------------------------------------------------------------------------------- /gazebo_plugins/test2/spawn_model/spawn_box_file.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/spawn_model/spawn_box_file.launch -------------------------------------------------------------------------------- /gazebo_plugins/test2/spawn_model/spawn_box_param.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/spawn_model/spawn_box_param.launch -------------------------------------------------------------------------------- /gazebo_plugins/test2/trimesh_tests/test_trimesh.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/trimesh_tests/test_trimesh.launch -------------------------------------------------------------------------------- /gazebo_plugins/test2/urdf/box.urdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/urdf/box.urdf -------------------------------------------------------------------------------- /gazebo_plugins/test2/urdf/cube.urdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/urdf/cube.urdf -------------------------------------------------------------------------------- /gazebo_plugins/test2/worlds/empty.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_plugins/test2/worlds/empty.world -------------------------------------------------------------------------------- /gazebo_ros/.idea/gazebo_ros.iml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/.idea/gazebo_ros.iml -------------------------------------------------------------------------------- /gazebo_ros/CHANGELOG.rst: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/CHANGELOG.rst -------------------------------------------------------------------------------- /gazebo_ros/CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/CMakeLists.txt -------------------------------------------------------------------------------- /gazebo_ros/cfg/Physics.cfg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/cfg/Physics.cfg -------------------------------------------------------------------------------- /gazebo_ros/colcon.pkg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/colcon.pkg -------------------------------------------------------------------------------- /gazebo_ros/include/gazebo_ros/gazebo_ros_api_plugin.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/include/gazebo_ros/gazebo_ros_api_plugin.h -------------------------------------------------------------------------------- /gazebo_ros/launch/elevator_world.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/launch/elevator_world.launch -------------------------------------------------------------------------------- /gazebo_ros/launch/empty_world.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/launch/empty_world.launch -------------------------------------------------------------------------------- /gazebo_ros/launch/mud_world.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/launch/mud_world.launch -------------------------------------------------------------------------------- /gazebo_ros/launch/range_world.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/launch/range_world.launch -------------------------------------------------------------------------------- /gazebo_ros/launch/rubble_world.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/launch/rubble_world.launch -------------------------------------------------------------------------------- /gazebo_ros/launch/shapes_world.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/launch/shapes_world.launch -------------------------------------------------------------------------------- /gazebo_ros/launch/willowgarage_world.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/launch/willowgarage_world.launch -------------------------------------------------------------------------------- /gazebo_ros/package.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/package.xml -------------------------------------------------------------------------------- /gazebo_ros/scripts/debug: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/debug -------------------------------------------------------------------------------- /gazebo_ros/scripts/debug.bat: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/debug.bat -------------------------------------------------------------------------------- /gazebo_ros/scripts/gazebo: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/gazebo -------------------------------------------------------------------------------- /gazebo_ros/scripts/gdbrun: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/gdbrun -------------------------------------------------------------------------------- /gazebo_ros/scripts/gzclient: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/gzclient -------------------------------------------------------------------------------- /gazebo_ros/scripts/gzclient.bat: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/gzclient.bat -------------------------------------------------------------------------------- /gazebo_ros/scripts/gzserver: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/gzserver -------------------------------------------------------------------------------- /gazebo_ros/scripts/gzserver.bat: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/gzserver.bat -------------------------------------------------------------------------------- /gazebo_ros/scripts/libcommon.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/libcommon.sh -------------------------------------------------------------------------------- /gazebo_ros/scripts/perf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/perf -------------------------------------------------------------------------------- /gazebo_ros/scripts/spawn_model: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/scripts/spawn_model -------------------------------------------------------------------------------- /gazebo_ros/setup.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/setup.py -------------------------------------------------------------------------------- /gazebo_ros/src/gazebo_ros/__init__.py: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /gazebo_ros/src/gazebo_ros/gazebo_interface.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/src/gazebo_ros/gazebo_interface.py -------------------------------------------------------------------------------- /gazebo_ros/src/gazebo_ros_api_plugin.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/src/gazebo_ros_api_plugin.cpp -------------------------------------------------------------------------------- /gazebo_ros/src/gazebo_ros_paths_plugin.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/src/gazebo_ros_paths_plugin.cpp -------------------------------------------------------------------------------- /gazebo_ros/test/CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/test/CMakeLists.txt -------------------------------------------------------------------------------- /gazebo_ros/test/ros_network/gazebo_network_api.yaml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/test/ros_network/gazebo_network_api.yaml -------------------------------------------------------------------------------- /gazebo_ros/test/ros_network/no_gazebo_network_api.yaml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/test/ros_network/no_gazebo_network_api.yaml -------------------------------------------------------------------------------- /gazebo_ros/test/ros_network/ros_api_checker: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/test/ros_network/ros_api_checker -------------------------------------------------------------------------------- /gazebo_ros/test/ros_network/ros_network_default.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/test/ros_network/ros_network_default.test -------------------------------------------------------------------------------- /gazebo_ros/test/ros_network/ros_network_disabled.test: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros/test/ros_network/ros_network_disabled.test -------------------------------------------------------------------------------- /gazebo_ros_control/CHANGELOG.rst: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/CHANGELOG.rst -------------------------------------------------------------------------------- /gazebo_ros_control/CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/CMakeLists.txt -------------------------------------------------------------------------------- /gazebo_ros_control/README.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/README.md -------------------------------------------------------------------------------- /gazebo_ros_control/colcon.pkg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/colcon.pkg -------------------------------------------------------------------------------- /gazebo_ros_control/include/gazebo_ros_control/default_robot_hw_sim.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/include/gazebo_ros_control/default_robot_hw_sim.h -------------------------------------------------------------------------------- /gazebo_ros_control/include/gazebo_ros_control/gazebo_ros_control_plugin.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/include/gazebo_ros_control/gazebo_ros_control_plugin.h -------------------------------------------------------------------------------- /gazebo_ros_control/include/gazebo_ros_control/robot_hw_sim.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/include/gazebo_ros_control/robot_hw_sim.h -------------------------------------------------------------------------------- /gazebo_ros_control/package.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/package.xml -------------------------------------------------------------------------------- /gazebo_ros_control/robot_hw_sim_plugins.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/robot_hw_sim_plugins.xml -------------------------------------------------------------------------------- /gazebo_ros_control/src/default_robot_hw_sim.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/src/default_robot_hw_sim.cpp -------------------------------------------------------------------------------- /gazebo_ros_control/src/gazebo_ros_control_plugin.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_control/src/gazebo_ros_control_plugin.cpp -------------------------------------------------------------------------------- /gazebo_ros_pkgs/CHANGELOG.rst: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_pkgs/CHANGELOG.rst -------------------------------------------------------------------------------- /gazebo_ros_pkgs/CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_pkgs/CMakeLists.txt -------------------------------------------------------------------------------- /gazebo_ros_pkgs/documentation/gazebo_ros_api.odg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_pkgs/documentation/gazebo_ros_api.odg -------------------------------------------------------------------------------- /gazebo_ros_pkgs/documentation/gazebo_ros_api.pdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_pkgs/documentation/gazebo_ros_api.pdf -------------------------------------------------------------------------------- /gazebo_ros_pkgs/documentation/gazebo_ros_api.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_pkgs/documentation/gazebo_ros_api.png -------------------------------------------------------------------------------- /gazebo_ros_pkgs/documentation/gazebo_ros_transmission.odg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_pkgs/documentation/gazebo_ros_transmission.odg -------------------------------------------------------------------------------- /gazebo_ros_pkgs/documentation/gazebo_ros_transmission.pdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_pkgs/documentation/gazebo_ros_transmission.pdf -------------------------------------------------------------------------------- /gazebo_ros_pkgs/documentation/gazebo_ros_transmission.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_pkgs/documentation/gazebo_ros_transmission.png -------------------------------------------------------------------------------- /gazebo_ros_pkgs/package.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/ros-simulation/gazebo_ros_pkgs/HEAD/gazebo_ros_pkgs/package.xml --------------------------------------------------------------------------------