Pinned Repositories
3D-Weld-Seam-Tracking-using-PCL
In this project we have used the Point Cloud Library/ Depth Image Processing and a 5 axis robotic manipulator to implement multiple systems like hand tracking, autonomous grasping and 3D Weld Seam tracking
abb_1410_moveit_config
This is the first implementation of ROS compatible files for abb 1410 Welding Robot. The URDF file was initially created using the Solidworks to URDF exporter. Then using the moveit setup assistant the moveit package was created and OpenRAVE is also used to find the ikfast Inverse Kinematics solver for the manipulator.
BirdWatcher
OpenCV Motion Detector to capture birds red handed
bottleneck_guided_rrt
This project consists of C++ implementations of a 3D Rapidly Exploring Random Tree and three other extensions called RRT*, Execution Extended RRT and Synchronised Greedy Biased RRT. It also includes a heuristically guided RRT* with biased sampling towards relevant bottleneck points predicted by a 3D CNN(modified VoxNet in Tensorflow).
GraphPlanning
Global planning for robotics based on graph search algorithms
mapf-roadmap
Roadmap of topics in multi agent path finding in 2023
motion-planning-roadmap
Roadmap of areas of study in motion planning
sketching_controller_mujoco
Simultaneous Force, velocity and position control of a RR planar manipulator for sketching
Team-MAVERICK-Autonomous-Systems
A ROS based autonomous self driving car capable of teleop_control, lane following, obstacle detection and rtabmapping the environment in real time
vimaan_ws
Sensor Fusion of local odometry and global position estimates
indraneelpatil's Repositories
indraneelpatil/bottleneck_guided_rrt
This project consists of C++ implementations of a 3D Rapidly Exploring Random Tree and three other extensions called RRT*, Execution Extended RRT and Synchronised Greedy Biased RRT. It also includes a heuristically guided RRT* with biased sampling towards relevant bottleneck points predicted by a 3D CNN(modified VoxNet in Tensorflow).
indraneelpatil/GraphPlanning
Global planning for robotics based on graph search algorithms
indraneelpatil/mapf-roadmap
Roadmap of topics in multi agent path finding in 2023
indraneelpatil/motion-planning-roadmap
Roadmap of areas of study in motion planning
indraneelpatil/sketching_controller_mujoco
Simultaneous Force, velocity and position control of a RR planar manipulator for sketching
indraneelpatil/vimaan_ws
Sensor Fusion of local odometry and global position estimates
indraneelpatil/BirdWatcher
OpenCV Motion Detector to capture birds red handed
indraneelpatil/python-slip-udp
Scripts to create raw IP packets, encapsulate them using slip and then send to usb serial devices
indraneelpatil/16831-Spring-2022
indraneelpatil/ardupilot
ArduPlane, ArduCopter, ArduRover source
indraneelpatil/BehaviorTree.CPP
Behavior Trees Library in C++. Batteries included.
indraneelpatil/c_source_tools
python based cmake tools for C Sources
indraneelpatil/cv_mindmaps
indraneelpatil/frankapy
Python interface to control Franka Emika Panda Research Robot Arms.
indraneelpatil/FreeRTOS-Plus-TCP
FreeRTOS-Plus-TCP library repository. +TCP files only. Submoduled into https://github.com/FreeRTOS/FreeRTOS and various other repos.
indraneelpatil/gor_waypoint_tracker
Given a list of piecewise linear set of obstacle free waypoints on the way to the goal destination, generate twist messages to reach goal with an optimal max velocity
indraneelpatil/gym
A toolkit for developing and comparing reinforcement learning algorithms.
indraneelpatil/indraneelpatil.github.io
Projects Assemble
indraneelpatil/intro_to_algo_clrs
Implementation of algorithms in clrs
indraneelpatil/mbp15-wifi-driver
Scripts to collect or download and install MacBookPro15,2 wifi driver files on Linux.
indraneelpatil/MindMaps
Backup of Mindmaps for xMind
indraneelpatil/navigation2
ROS2 Navigation Framework and System
indraneelpatil/non_catkin_cmake_for_ros
Using ros nodes in the source file without catkinizing the cmake build system
indraneelpatil/protobuf_parser
Template for packing/unpacking using protobuf protocol
indraneelpatil/pybind_protobuf_cmake_test
Testing
indraneelpatil/reciprocal_velocity_obstacles
Libraries which implement reciprocal velocity obstacles
indraneelpatil/ros_best_practices
Best practices, conventions, and tricks for ROS
indraneelpatil/ros_docker_resources
Reference for docker related projects
indraneelpatil/tf_global_localisation
Merging global position estimates into your tf tree smoothly for continuous localisation
indraneelpatil/travelling_salesman_problem