Skip to content

Instantly share code, notes, and snippets.

@ditodamaru
ditodamaru / rotate_2d_point.py
Created May 27, 2024 13:34 — forked from LyleScott/rotate_2d_point.py
Rotate X,Y (2D) coordinates around a point or origin in Python
"""
Lyle Scott, III // [email protected]
Multiple ways to rotate a 2D point around the origin / a point.
Timer benchmark results @ https://gist.github.com/LyleScott/d17e9d314fbe6fc29767d8c5c029c362
"""
from __future__ import print_function
import math
@ditodamaru
ditodamaru / cmd_vel_to_ackermann_drive.py
Created April 28, 2024 07:14 — forked from hdh7485/cmd_vel_to_ackermann_drive.py
Convert twist message to ackermann message.
#!/usr/bin/env python
# Author: [email protected]
# Modifier: Donghee Han, [email protected]
import rospy, math
from geometry_msgs.msg import Twist
from ackermann_msgs.msg import AckermannDriveStamped
from ackermann_msgs.msg import AckermannDrive
@ditodamaru
ditodamaru / .rocker-github.md
Created April 11, 2024 05:43 — forked from audrow/.rocker-github.md
My ROS 2 and Gazebo Docker Setup

README

My ROS 2 and Gazebo Docker setup. This can be extended or used an example for other Docker containers that want to use graphics and have persistent volumes.

Features

  • Run Gazebo and ROS 2 in a Docker container
  • Persistent workspace
  • Graphics support
@ditodamaru
ditodamaru / android-backup-apk-and-datas.md
Created January 19, 2024 11:44 — forked from AnatomicJC/android-backup-apk-and-datas.md
Backup android app, data included, no root needed, with adb

Backup android app, data included, no root needed, with adb

adb is the Android CLI tool with which you can interact with your android device, from your PC

You must enable developer mode (tap 7 times on the build version in parameters) and install adb on your PC.

Don't hesitate to read comments, there is useful tips, thanks guys for this !

Fetch application APK

Ground Truth Explanation
https://projects.asl.ethz.ch/datasets/doku.php?id=kmavvisualinertialdatasets
Key Address dataset for SLAM
https://github.com/UZ-SLAMLab/ORB_SLAM3
Robot localization (check rosrun tf_echo odom base_link)
https://roboticsknowledgebase.com/wiki/common-platforms/ros/ros-mapping-localization/
@ditodamaru
ditodamaru / bag_to_png.py
Created April 26, 2023 08:53 — forked from rohanpsingh/bag_to_png.py
Script to extract depth and rgb frames for a rosbag file.
import argparse
import os
import sys
import cv2
import matplotlib.pyplot as plt
import numpy as np
from cv_bridge import CvBridge, CvBridgeError
sys.path.append("/usr/lib/python2.7/dist-packages/")
import rospy
import rosbag