Pinned Repositories
ahbconvert
ahbconvert
decklink_capture
Stream images captured by Blackmagic DeckLink using its SDK to ROS as sensor_msgs/Image
FusionSDF
Export Fusion 360 designs to SDF (Simulation Description Format)
gazebo2rviz
Automatically import all entities simulated in ROS-enabled Gazebo or described in a set of SDF files into rviz through the TF and Marker plugin. Furthermore add objects from a SDF as MoveIt collision objects.
holoruch
Hands-on Learning of ROS using Common Hardware
pysdf
Python library to parse SDF into class hierarchy and export URDF
robotics_fundamentals_ros_gazebo
ROSCon DE 2023 talk "Learning Robotics Fundamentals with ROS 2 and modern Gazebo"
ros_poster
ROS poster showing all distributions, based on https://github.com/ros-infrastructure/artwork
tf_visual_calc
Rviz GUI plugin that allows to manually define a TF tree through various representations (Vector+Quaternion, Homogenous, Vector+RPY, Denavit-Hartenberg) and converting between them
ur5_safe_cartesian
Translate geometry_msgs/Pose messages (cartesian pose) to sensor_msgs/JointState messages (joint positions) for the Universal Robots UR5 with reachability and static collision checking
andreasBihlmaier's Repositories
andreasBihlmaier/ur5_safe_cartesian
Translate geometry_msgs/Pose messages (cartesian pose) to sensor_msgs/JointState messages (joint positions) for the Universal Robots UR5 with reachability and static collision checking
andreasBihlmaier/holoruch
Hands-on Learning of ROS using Common Hardware
andreasBihlmaier/ahbros
ahb utilities: ros dependent functionality
andreasBihlmaier/industrial_calibration_helpers
Helper scripts and tutorial related material for http://wiki.ros.org/industrial_extrinsic_cal
andreasBihlmaier/streameye
A simple MJPEG streamer for Linux
andreasBihlmaier/ur_lowlevel_gazebo
Gazebo plugin exposing the same binary interface to a simulated Universal Robots UR5 as used for the real robot by the ur_driver package
andreasBihlmaier/viky
ROS interface to control a ViKY endoscope holder
andreasBihlmaier/ahb_sdf_example
Simple example of getting a CAD model into Gazebo via SDF.
andreasBihlmaier/arni
this is the codebase of the Advanced ROS Network Introspection.
andreasBihlmaier/camera_umd
andreasBihlmaier/cmvision
cmvision port for ROS Hydro
andreasBihlmaier/cmvision_3d
This python package extends the cmvision package to track color blobs in the tf tree.
andreasBihlmaier/design
Design documentation for ROS 2.0 effort
andreasBihlmaier/EPL_DataCollect
An extensible platform for collecting data of an ethernetPOWERLINK setup
andreasBihlmaier/gazebo_ros_pkgs
Wrappers, tools and additional API's for using ROS with Gazebo
andreasBihlmaier/gscam
ROS Camera driver for GStreamer-based video streams.
andreasBihlmaier/industrial_calibration
Contains libraries/algorithms for calibration industrial systems
andreasBihlmaier/liblibwireshark
Leverage the libwireshark v2.4.0 capture and dissector API in your own application
andreasBihlmaier/lwr_gazebo
Gazebo plugin exposing a KUKA FRI interface to a simulated KUKA LWR4+
andreasBihlmaier/lwr_ros2fri
Translate ROS sensor_msgs/JointState topic to KUKA FRI
andreasBihlmaier/lwr_safe_cartesian
Translate geometry_msgs/Pose messages (cartesian pose) to sensor_msgs/JointState messages (joint positions) for the KUKA LWR4+ with reachability and static collision checking
andreasBihlmaier/NuttX
Standard NuttX (http://nuttx.org) with current PX4 WIP patches
andreasBihlmaier/opencv
Open Source Computer Vision Library
andreasBihlmaier/raspicam_node
ROS node for camera module of Raspberry Pi
andreasBihlmaier/robot_joint_position_controller_gazebo
Generic Gazebo ModelPlugin that allows to control all model joints through sensor_msgs/JointState topics. One topic for all joints and one topic per joint
andreasBihlmaier/rpi_ws281x
Userspace Raspberry Pi PWM library for WS281X LEDs
andreasBihlmaier/rviz_melodic_urdf_issue
Test data for https://github.com/ros-visualization/rviz/issues/1249
andreasBihlmaier/safe_cartesian_moveit
Library that uses MoveIt! to check for collisions along a provided path
andreasBihlmaier/safe_cartesian_msgs
Message and Service definitions for *_safe_cartesian packages
andreasBihlmaier/ur5_moveit_kinematics
MoveIt Kinematics Plugin wrapper for ur_kinematics