├── .gitignore ├── CMakeLists.txt ├── README.md ├── cmake ├── FindEigen3.cmake ├── FindMatlab.cmake ├── FindOGRE.cmake ├── FindOIS.cmake ├── FindPQP.cmake ├── FindPkgMacros.cmake ├── LibFindMacros.cmake ├── OgreConfigTargets.cmake ├── OgreFindFrameworks.cmake ├── OgreGetVersion.cmake ├── PreprocessorUtils.cmake └── VisualStudioUserFile.vcproj.user.in ├── docs ├── .gitignore ├── documentation.pdf ├── documentation.tex └── matlab_documentation │ ├── GazeboMatlabSimulator_doc.html │ ├── GazeboMatlabSimulator_doc_files │ └── helpwin.css │ ├── MatlabLinkInput_doc.html │ ├── MatlabLinkInput_doc_files │ └── helpwin.css │ ├── MatlabRigidBodyState_doc.html │ ├── MatlabRigidBodyState_doc_files │ └── helpwin.css │ ├── contents_report.html │ └── contents_report_files │ ├── matlab-report-styles.css │ └── matlabreports.js ├── include └── gazebo_rosmatlab_bridge │ ├── buffered_mmap.h │ ├── mex_utils.h │ ├── mmap.h │ ├── pqpmesh.h │ └── shared_mmap.h ├── launch └── basic.launch ├── matlab_scripts ├── .gitignore ├── AuvSetup.m ├── Contents.m ├── EvaluateJacobians.m ├── GazeboMatlabSimulator.m ├── MarkerInfo.m ├── MatlabLinkInput.m ├── MatlabPqpManager.m ├── MatlabRigidBodyState.m ├── arm_closedloop.m ├── arm_computedtorquelaw.m ├── arm_sddp_analytic.m ├── arm_sddp_gazebo.m ├── arm_shooting.m ├── car_closedloop.m ├── car_sddp_analytic.m ├── car_sddp_gazebov1.m ├── car_sddp_gazebov2.m ├── car_sddp_gazebov3.m ├── car_shooting.m ├── cyton_servo_control.m ├── draw_rb.m ├── mex_mmap.m ├── pqp_example.m ├── quad_bs.m ├── quadcopter_shooting.m ├── quat2mat.m ├── quat2rpy.m ├── quatinv.m ├── quatmultiply.m ├── quatrotate.m ├── rpy2quat.m ├── satellite_test.m ├── sddp.m ├── sopt7.m ├── sopt_car.m ├── wam_servo_control.m ├── wam_shooting.m └── wcov.m ├── models ├── WAM Model ROS │ ├── meshes │ │ ├── bh_base.stl │ │ ├── bh_link1.stl │ │ ├── bh_link2.stl │ │ ├── bh_link3.stl │ │ ├── wam1.stl │ │ ├── wam2.stl │ │ ├── wam3.stl │ │ ├── wam4.stl │ │ ├── wam5.stl │ │ ├── wam6.stl │ │ ├── wam7.stl │ │ └── wambase.stl │ ├── model.config │ └── wam.sdf ├── airbot │ ├── airbot5.urdf │ ├── meshes │ │ └── quadrotor_base.dae │ ├── model.config │ └── model.sdf ├── auv_body │ ├── auv_body.sdf │ ├── auv_body_withoutgripperandtorpedos.sdf │ └── model.config ├── cyton_gamma_1500_description │ ├── cyton_gamma_1500.sdf │ ├── meshes │ │ ├── base.dae │ │ ├── elbow_pitch.dae │ │ ├── elbow_yaw.dae │ │ ├── gripper_finger1.dae │ │ ├── gripper_finger2.dae │ │ ├── shoulder_pitch.dae │ │ ├── shoulder_roll.dae │ │ ├── shoulder_yaw.dae │ │ ├── wrist_pitch.dae │ │ └── wrist_roll.dae │ └── model.config ├── gripper │ ├── gripper.sdf │ └── model.config ├── ground_plane_with_visual_plugin │ ├── model.config │ └── model.sdf ├── hole_table │ ├── meshes │ │ └── hole_part.dae │ ├── model.config │ └── model.sdf ├── irobot_hand_simplified │ ├── model-1_3.sdf │ ├── model-1_4.sdf │ ├── model.config │ └── model.sdf ├── matlabcamera │ ├── model.config │ └── model.sdf ├── modelcity │ ├── .gitignore │ ├── meshes │ │ ├── Brick_Antique.jpg │ │ ├── Brick_Colored_Blue.jpg │ │ ├── Brick_Pavers_Herringbone.jpg │ │ ├── Brick_Rough_Tan.jpg │ │ ├── Concrete_Block_8x8_Gray.jpg │ │ ├── Concrete_Block_Retaining_Gray.jpg │ │ ├── Vegetation_Grass_Artificial.jpg │ │ ├── Water_Deep.jpg │ │ ├── Water_Pool_Light.jpg │ │ ├── city-cool.dae │ │ ├── city.stl │ │ └── city_corrected_normals.stl │ ├── model.config │ └── model.sdf ├── ragdoll │ ├── model-1_4.sdf │ ├── model.config │ └── model.sdf ├── rccar │ ├── meshes │ │ ├── .gitignore │ │ ├── Wheel.dae │ │ └── traxxas1.dae │ ├── model.config │ └── rccar.sdf ├── rod │ ├── model.config │ └── model.sdf ├── satellite │ ├── meshes │ │ └── cone.dae │ ├── model.config │ └── model.sdf ├── thruster │ ├── meshes │ │ └── cone.dae │ ├── model.config │ └── thruster.sdf ├── torpedo │ ├── Find Results │ ├── model.config │ ├── torpedo.blend1 │ ├── torpedo.dae │ └── torpedo.sdf └── water_scene │ ├── meshes │ └── singapore_scena.dae │ ├── model.config │ └── model.sdf ├── msg ├── AddServo.msg ├── AvailableNames.msg ├── BodyWrenches.msg ├── CompleteModelState.msg ├── JointEfforts.msg ├── JointState.msg ├── JointStates.msg ├── PhysicsEngineConfig.msg └── RunSimulation.msg ├── package.xml ├── pqp_setup.bash ├── setup_script.bash ├── src ├── .gitignore ├── bridge_node.cpp ├── camera_matlab_plugin.cpp ├── gazebo_matlab_pluginbridge.cpp ├── mesh.cc ├── mesh.h ├── mex_mmap_interface.cpp ├── mex_pqp_interface.cpp └── trajectory_visualizer_plugin.cpp └── worlds ├── .gitignore ├── quadrotor_modelcity.world ├── quadrotor_powerplant.world ├── rccar_modelcity.world ├── satellite_witharm.world ├── scene1.world ├── scene1_obstacle.world ├── scene2.world ├── scene3.world ├── scene4.world ├── scene5.world ├── scene6.world ├── scene7.world ├── scene8.world ├── scene9.world ├── simple_obstacles.world ├── wam_obstacle.world └── youbot_industryscenario.world /.gitignore: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/.gitignore -------------------------------------------------------------------------------- /CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/CMakeLists.txt -------------------------------------------------------------------------------- /README.md: -------------------------------------------------------------------------------- 1 | Lookup [__WIKI__](https://github.com/jhu-asco/gazebo_rosmatlab_bridge/wiki) 2 | -------------------------------------------------------------------------------- /cmake/FindEigen3.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/FindEigen3.cmake -------------------------------------------------------------------------------- /cmake/FindMatlab.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/FindMatlab.cmake -------------------------------------------------------------------------------- /cmake/FindOGRE.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/FindOGRE.cmake -------------------------------------------------------------------------------- /cmake/FindOIS.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/FindOIS.cmake -------------------------------------------------------------------------------- /cmake/FindPQP.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/FindPQP.cmake -------------------------------------------------------------------------------- /cmake/FindPkgMacros.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/FindPkgMacros.cmake -------------------------------------------------------------------------------- /cmake/LibFindMacros.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/LibFindMacros.cmake -------------------------------------------------------------------------------- /cmake/OgreConfigTargets.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/OgreConfigTargets.cmake -------------------------------------------------------------------------------- /cmake/OgreFindFrameworks.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/OgreFindFrameworks.cmake -------------------------------------------------------------------------------- /cmake/OgreGetVersion.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/OgreGetVersion.cmake -------------------------------------------------------------------------------- /cmake/PreprocessorUtils.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/PreprocessorUtils.cmake -------------------------------------------------------------------------------- /cmake/VisualStudioUserFile.vcproj.user.in: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/cmake/VisualStudioUserFile.vcproj.user.in -------------------------------------------------------------------------------- /docs/.gitignore: -------------------------------------------------------------------------------- 1 | *.aux 2 | *.log 3 | *.tex~ 4 | -------------------------------------------------------------------------------- /docs/documentation.pdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/documentation.pdf -------------------------------------------------------------------------------- /docs/documentation.tex: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/documentation.tex -------------------------------------------------------------------------------- /docs/matlab_documentation/GazeboMatlabSimulator_doc.html: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/matlab_documentation/GazeboMatlabSimulator_doc.html -------------------------------------------------------------------------------- /docs/matlab_documentation/GazeboMatlabSimulator_doc_files/helpwin.css: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/matlab_documentation/GazeboMatlabSimulator_doc_files/helpwin.css -------------------------------------------------------------------------------- /docs/matlab_documentation/MatlabLinkInput_doc.html: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/matlab_documentation/MatlabLinkInput_doc.html -------------------------------------------------------------------------------- /docs/matlab_documentation/MatlabLinkInput_doc_files/helpwin.css: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/matlab_documentation/MatlabLinkInput_doc_files/helpwin.css -------------------------------------------------------------------------------- /docs/matlab_documentation/MatlabRigidBodyState_doc.html: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/matlab_documentation/MatlabRigidBodyState_doc.html -------------------------------------------------------------------------------- /docs/matlab_documentation/MatlabRigidBodyState_doc_files/helpwin.css: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/matlab_documentation/MatlabRigidBodyState_doc_files/helpwin.css -------------------------------------------------------------------------------- /docs/matlab_documentation/contents_report.html: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/matlab_documentation/contents_report.html -------------------------------------------------------------------------------- /docs/matlab_documentation/contents_report_files/matlab-report-styles.css: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/matlab_documentation/contents_report_files/matlab-report-styles.css -------------------------------------------------------------------------------- /docs/matlab_documentation/contents_report_files/matlabreports.js: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/docs/matlab_documentation/contents_report_files/matlabreports.js -------------------------------------------------------------------------------- /include/gazebo_rosmatlab_bridge/buffered_mmap.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/include/gazebo_rosmatlab_bridge/buffered_mmap.h -------------------------------------------------------------------------------- /include/gazebo_rosmatlab_bridge/mex_utils.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/include/gazebo_rosmatlab_bridge/mex_utils.h -------------------------------------------------------------------------------- /include/gazebo_rosmatlab_bridge/mmap.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/include/gazebo_rosmatlab_bridge/mmap.h -------------------------------------------------------------------------------- /include/gazebo_rosmatlab_bridge/pqpmesh.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/include/gazebo_rosmatlab_bridge/pqpmesh.h -------------------------------------------------------------------------------- /include/gazebo_rosmatlab_bridge/shared_mmap.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/include/gazebo_rosmatlab_bridge/shared_mmap.h -------------------------------------------------------------------------------- /launch/basic.launch: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/launch/basic.launch -------------------------------------------------------------------------------- /matlab_scripts/.gitignore: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/.gitignore -------------------------------------------------------------------------------- /matlab_scripts/AuvSetup.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/AuvSetup.m -------------------------------------------------------------------------------- /matlab_scripts/Contents.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/Contents.m -------------------------------------------------------------------------------- /matlab_scripts/EvaluateJacobians.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/EvaluateJacobians.m -------------------------------------------------------------------------------- /matlab_scripts/GazeboMatlabSimulator.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/GazeboMatlabSimulator.m -------------------------------------------------------------------------------- /matlab_scripts/MarkerInfo.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/MarkerInfo.m -------------------------------------------------------------------------------- /matlab_scripts/MatlabLinkInput.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/MatlabLinkInput.m -------------------------------------------------------------------------------- /matlab_scripts/MatlabPqpManager.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/MatlabPqpManager.m -------------------------------------------------------------------------------- /matlab_scripts/MatlabRigidBodyState.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/MatlabRigidBodyState.m -------------------------------------------------------------------------------- /matlab_scripts/arm_closedloop.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/arm_closedloop.m -------------------------------------------------------------------------------- /matlab_scripts/arm_computedtorquelaw.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/arm_computedtorquelaw.m -------------------------------------------------------------------------------- /matlab_scripts/arm_sddp_analytic.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/arm_sddp_analytic.m -------------------------------------------------------------------------------- /matlab_scripts/arm_sddp_gazebo.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/arm_sddp_gazebo.m -------------------------------------------------------------------------------- /matlab_scripts/arm_shooting.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/arm_shooting.m -------------------------------------------------------------------------------- /matlab_scripts/car_closedloop.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/car_closedloop.m -------------------------------------------------------------------------------- /matlab_scripts/car_sddp_analytic.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/car_sddp_analytic.m -------------------------------------------------------------------------------- /matlab_scripts/car_sddp_gazebov1.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/car_sddp_gazebov1.m -------------------------------------------------------------------------------- /matlab_scripts/car_sddp_gazebov2.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/car_sddp_gazebov2.m -------------------------------------------------------------------------------- /matlab_scripts/car_sddp_gazebov3.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/car_sddp_gazebov3.m -------------------------------------------------------------------------------- /matlab_scripts/car_shooting.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/car_shooting.m -------------------------------------------------------------------------------- /matlab_scripts/cyton_servo_control.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/cyton_servo_control.m -------------------------------------------------------------------------------- /matlab_scripts/draw_rb.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/draw_rb.m -------------------------------------------------------------------------------- /matlab_scripts/mex_mmap.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/mex_mmap.m -------------------------------------------------------------------------------- /matlab_scripts/pqp_example.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/pqp_example.m -------------------------------------------------------------------------------- /matlab_scripts/quad_bs.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/quad_bs.m -------------------------------------------------------------------------------- /matlab_scripts/quadcopter_shooting.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/quadcopter_shooting.m -------------------------------------------------------------------------------- /matlab_scripts/quat2mat.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/quat2mat.m -------------------------------------------------------------------------------- /matlab_scripts/quat2rpy.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/quat2rpy.m -------------------------------------------------------------------------------- /matlab_scripts/quatinv.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/quatinv.m -------------------------------------------------------------------------------- /matlab_scripts/quatmultiply.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/quatmultiply.m -------------------------------------------------------------------------------- /matlab_scripts/quatrotate.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/quatrotate.m -------------------------------------------------------------------------------- /matlab_scripts/rpy2quat.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/rpy2quat.m -------------------------------------------------------------------------------- /matlab_scripts/satellite_test.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/satellite_test.m -------------------------------------------------------------------------------- /matlab_scripts/sddp.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/sddp.m -------------------------------------------------------------------------------- /matlab_scripts/sopt7.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/sopt7.m -------------------------------------------------------------------------------- /matlab_scripts/sopt_car.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/sopt_car.m -------------------------------------------------------------------------------- /matlab_scripts/wam_servo_control.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/wam_servo_control.m -------------------------------------------------------------------------------- /matlab_scripts/wam_shooting.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/wam_shooting.m -------------------------------------------------------------------------------- /matlab_scripts/wcov.m: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/matlab_scripts/wcov.m -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/bh_base.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/bh_base.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/bh_link1.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/bh_link1.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/bh_link2.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/bh_link2.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/bh_link3.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/bh_link3.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/wam1.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/wam1.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/wam2.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/wam2.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/wam3.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/wam3.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/wam4.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/wam4.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/wam5.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/wam5.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/wam6.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/wam6.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/wam7.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/wam7.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/meshes/wambase.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/meshes/wambase.stl -------------------------------------------------------------------------------- /models/WAM Model ROS/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/model.config -------------------------------------------------------------------------------- /models/WAM Model ROS/wam.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/WAM Model ROS/wam.sdf -------------------------------------------------------------------------------- /models/airbot/airbot5.urdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/airbot/airbot5.urdf -------------------------------------------------------------------------------- /models/airbot/meshes/quadrotor_base.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/airbot/meshes/quadrotor_base.dae -------------------------------------------------------------------------------- /models/airbot/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/airbot/model.config -------------------------------------------------------------------------------- /models/airbot/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/airbot/model.sdf -------------------------------------------------------------------------------- /models/auv_body/auv_body.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/auv_body/auv_body.sdf -------------------------------------------------------------------------------- /models/auv_body/auv_body_withoutgripperandtorpedos.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/auv_body/auv_body_withoutgripperandtorpedos.sdf -------------------------------------------------------------------------------- /models/auv_body/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/auv_body/model.config -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/cyton_gamma_1500.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/cyton_gamma_1500.sdf -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/meshes/base.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/meshes/base.dae -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/meshes/elbow_pitch.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/meshes/elbow_pitch.dae -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/meshes/elbow_yaw.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/meshes/elbow_yaw.dae -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/meshes/gripper_finger1.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/meshes/gripper_finger1.dae -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/meshes/gripper_finger2.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/meshes/gripper_finger2.dae -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/meshes/shoulder_pitch.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/meshes/shoulder_pitch.dae -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/meshes/shoulder_roll.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/meshes/shoulder_roll.dae -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/meshes/shoulder_yaw.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/meshes/shoulder_yaw.dae -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/meshes/wrist_pitch.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/meshes/wrist_pitch.dae -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/meshes/wrist_roll.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/meshes/wrist_roll.dae -------------------------------------------------------------------------------- /models/cyton_gamma_1500_description/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/cyton_gamma_1500_description/model.config -------------------------------------------------------------------------------- /models/gripper/gripper.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/gripper/gripper.sdf -------------------------------------------------------------------------------- /models/gripper/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/gripper/model.config -------------------------------------------------------------------------------- /models/ground_plane_with_visual_plugin/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/ground_plane_with_visual_plugin/model.config -------------------------------------------------------------------------------- /models/ground_plane_with_visual_plugin/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/ground_plane_with_visual_plugin/model.sdf -------------------------------------------------------------------------------- /models/hole_table/meshes/hole_part.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/hole_table/meshes/hole_part.dae -------------------------------------------------------------------------------- /models/hole_table/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/hole_table/model.config -------------------------------------------------------------------------------- /models/hole_table/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/hole_table/model.sdf -------------------------------------------------------------------------------- /models/irobot_hand_simplified/model-1_3.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/irobot_hand_simplified/model-1_3.sdf -------------------------------------------------------------------------------- /models/irobot_hand_simplified/model-1_4.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/irobot_hand_simplified/model-1_4.sdf -------------------------------------------------------------------------------- /models/irobot_hand_simplified/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/irobot_hand_simplified/model.config -------------------------------------------------------------------------------- /models/irobot_hand_simplified/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/irobot_hand_simplified/model.sdf -------------------------------------------------------------------------------- /models/matlabcamera/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/matlabcamera/model.config -------------------------------------------------------------------------------- /models/matlabcamera/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/matlabcamera/model.sdf -------------------------------------------------------------------------------- /models/modelcity/.gitignore: -------------------------------------------------------------------------------- 1 | *.jpg 2 | -------------------------------------------------------------------------------- /models/modelcity/meshes/Brick_Antique.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/Brick_Antique.jpg -------------------------------------------------------------------------------- /models/modelcity/meshes/Brick_Colored_Blue.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/Brick_Colored_Blue.jpg -------------------------------------------------------------------------------- /models/modelcity/meshes/Brick_Pavers_Herringbone.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/Brick_Pavers_Herringbone.jpg -------------------------------------------------------------------------------- /models/modelcity/meshes/Brick_Rough_Tan.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/Brick_Rough_Tan.jpg -------------------------------------------------------------------------------- /models/modelcity/meshes/Concrete_Block_8x8_Gray.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/Concrete_Block_8x8_Gray.jpg -------------------------------------------------------------------------------- /models/modelcity/meshes/Concrete_Block_Retaining_Gray.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/Concrete_Block_Retaining_Gray.jpg -------------------------------------------------------------------------------- /models/modelcity/meshes/Vegetation_Grass_Artificial.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/Vegetation_Grass_Artificial.jpg -------------------------------------------------------------------------------- /models/modelcity/meshes/Water_Deep.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/Water_Deep.jpg -------------------------------------------------------------------------------- /models/modelcity/meshes/Water_Pool_Light.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/Water_Pool_Light.jpg -------------------------------------------------------------------------------- /models/modelcity/meshes/city-cool.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/city-cool.dae -------------------------------------------------------------------------------- /models/modelcity/meshes/city.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/city.stl -------------------------------------------------------------------------------- /models/modelcity/meshes/city_corrected_normals.stl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/meshes/city_corrected_normals.stl -------------------------------------------------------------------------------- /models/modelcity/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/model.config -------------------------------------------------------------------------------- /models/modelcity/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/modelcity/model.sdf -------------------------------------------------------------------------------- /models/ragdoll/model-1_4.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/ragdoll/model-1_4.sdf -------------------------------------------------------------------------------- /models/ragdoll/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/ragdoll/model.config -------------------------------------------------------------------------------- /models/ragdoll/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/ragdoll/model.sdf -------------------------------------------------------------------------------- /models/rccar/meshes/.gitignore: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/rccar/meshes/.gitignore -------------------------------------------------------------------------------- /models/rccar/meshes/Wheel.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/rccar/meshes/Wheel.dae -------------------------------------------------------------------------------- /models/rccar/meshes/traxxas1.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/rccar/meshes/traxxas1.dae -------------------------------------------------------------------------------- /models/rccar/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/rccar/model.config -------------------------------------------------------------------------------- /models/rccar/rccar.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/rccar/rccar.sdf -------------------------------------------------------------------------------- /models/rod/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/rod/model.config -------------------------------------------------------------------------------- /models/rod/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/rod/model.sdf -------------------------------------------------------------------------------- /models/satellite/meshes/cone.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/satellite/meshes/cone.dae -------------------------------------------------------------------------------- /models/satellite/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/satellite/model.config -------------------------------------------------------------------------------- /models/satellite/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/satellite/model.sdf -------------------------------------------------------------------------------- /models/thruster/meshes/cone.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/thruster/meshes/cone.dae -------------------------------------------------------------------------------- /models/thruster/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/thruster/model.config -------------------------------------------------------------------------------- /models/thruster/thruster.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/thruster/thruster.sdf -------------------------------------------------------------------------------- /models/torpedo/Find Results: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/torpedo/Find Results -------------------------------------------------------------------------------- /models/torpedo/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/torpedo/model.config -------------------------------------------------------------------------------- /models/torpedo/torpedo.blend1: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/torpedo/torpedo.blend1 -------------------------------------------------------------------------------- /models/torpedo/torpedo.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/torpedo/torpedo.dae -------------------------------------------------------------------------------- /models/torpedo/torpedo.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/torpedo/torpedo.sdf -------------------------------------------------------------------------------- /models/water_scene/meshes/singapore_scena.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/water_scene/meshes/singapore_scena.dae -------------------------------------------------------------------------------- /models/water_scene/model.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/water_scene/model.config -------------------------------------------------------------------------------- /models/water_scene/model.sdf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/models/water_scene/model.sdf -------------------------------------------------------------------------------- /msg/AddServo.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/msg/AddServo.msg -------------------------------------------------------------------------------- /msg/AvailableNames.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/msg/AvailableNames.msg -------------------------------------------------------------------------------- /msg/BodyWrenches.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/msg/BodyWrenches.msg -------------------------------------------------------------------------------- /msg/CompleteModelState.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/msg/CompleteModelState.msg -------------------------------------------------------------------------------- /msg/JointEfforts.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/msg/JointEfforts.msg -------------------------------------------------------------------------------- /msg/JointState.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/msg/JointState.msg -------------------------------------------------------------------------------- /msg/JointStates.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/msg/JointStates.msg -------------------------------------------------------------------------------- /msg/PhysicsEngineConfig.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/msg/PhysicsEngineConfig.msg -------------------------------------------------------------------------------- /msg/RunSimulation.msg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/msg/RunSimulation.msg -------------------------------------------------------------------------------- /package.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/package.xml -------------------------------------------------------------------------------- /pqp_setup.bash: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/pqp_setup.bash -------------------------------------------------------------------------------- /setup_script.bash: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/setup_script.bash -------------------------------------------------------------------------------- /src/.gitignore: -------------------------------------------------------------------------------- 1 | *.bak* 2 | stl_correct.cpp 3 | -------------------------------------------------------------------------------- /src/bridge_node.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/src/bridge_node.cpp -------------------------------------------------------------------------------- /src/camera_matlab_plugin.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/src/camera_matlab_plugin.cpp -------------------------------------------------------------------------------- /src/gazebo_matlab_pluginbridge.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/src/gazebo_matlab_pluginbridge.cpp -------------------------------------------------------------------------------- /src/mesh.cc: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/src/mesh.cc -------------------------------------------------------------------------------- /src/mesh.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/src/mesh.h -------------------------------------------------------------------------------- /src/mex_mmap_interface.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/src/mex_mmap_interface.cpp -------------------------------------------------------------------------------- /src/mex_pqp_interface.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/src/mex_pqp_interface.cpp -------------------------------------------------------------------------------- /src/trajectory_visualizer_plugin.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/src/trajectory_visualizer_plugin.cpp -------------------------------------------------------------------------------- /worlds/.gitignore: -------------------------------------------------------------------------------- 1 | proposal_stuff 2 | -------------------------------------------------------------------------------- /worlds/quadrotor_modelcity.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/quadrotor_modelcity.world -------------------------------------------------------------------------------- /worlds/quadrotor_powerplant.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/quadrotor_powerplant.world -------------------------------------------------------------------------------- /worlds/rccar_modelcity.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/rccar_modelcity.world -------------------------------------------------------------------------------- /worlds/satellite_witharm.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/satellite_witharm.world -------------------------------------------------------------------------------- /worlds/scene1.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/scene1.world -------------------------------------------------------------------------------- /worlds/scene1_obstacle.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/scene1_obstacle.world -------------------------------------------------------------------------------- /worlds/scene2.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/scene2.world -------------------------------------------------------------------------------- /worlds/scene3.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/scene3.world -------------------------------------------------------------------------------- /worlds/scene4.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/scene4.world -------------------------------------------------------------------------------- /worlds/scene5.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/scene5.world -------------------------------------------------------------------------------- /worlds/scene6.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/scene6.world -------------------------------------------------------------------------------- /worlds/scene7.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/scene7.world -------------------------------------------------------------------------------- /worlds/scene8.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/scene8.world -------------------------------------------------------------------------------- /worlds/scene9.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/scene9.world -------------------------------------------------------------------------------- /worlds/simple_obstacles.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/simple_obstacles.world -------------------------------------------------------------------------------- /worlds/wam_obstacle.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/wam_obstacle.world -------------------------------------------------------------------------------- /worlds/youbot_industryscenario.world: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/jhu-asco/gazebo_rosmatlab_bridge/HEAD/worlds/youbot_industryscenario.world --------------------------------------------------------------------------------