Skip to content

Instantly share code, notes, and snippets.

View SteveMacenski's full-sized avatar
👾

Steve Macenski SteveMacenski

👾
View GitHub Profile
"""
Extended kalman filter (EKF) localization sample
author: Atsushi Sakai (@Atsushi_twi)
"""
import math
*** Steve's ROS Bloom Guide ***
A Release your project using GitHub releases.
Name the release the version (e.g. `0.4.3`) off the branch (e.g. diamondback-devel).
This version must also match the `package.xml` version number.
- If this is the first time releasing, you need to make a release repository.
It should be of name `<project_name>-release` (e.g. https://github.com/ros-planning/navigation2-release.git).
- Run `bloom-release navigation2 --track diamondback --rosdistro diamondback --edit`
@SteveMacenski
SteveMacenski / depth_compare_metrics.py
Created March 9, 2020 00:12
Depth Camera Basic Characteristic Comparison
#!/usr/bin/env python
from __future__ import print_function
import roslib
import sys
import rospy
import cv2
from std_msgs.msg import String
import numpy
from sensor_msgs.msg import Image
// Copyright (c) 2019 Steven Macenski
//
// Licensed under the Apache License, Version 2.0 (the "License");
// you may not use this file except in compliance with the License.
// You may obtain a copy of the License at
//
// http://www.apache.org/licenses/LICENSE-2.0
//
// Unless required by applicable law or agreed to in writing, software
// distributed under the License is distributed on an "AS IS" BASIS,
@SteveMacenski
SteveMacenski / hokuyo.launch
Created November 8, 2018 21:20
Example Hokuyo ros launch file
<launch>
<node pkg="urg_node" type="urg_node" output="screen" name="urg_node" respawn="true">
<param name="ip_address" value="10.2.98.10" />
<param name="frame_id" value="base_laser_link" />
<remap from="scan" to="scan_raw" />
<remap from="scan_filtered" to="scan_filtered" />
</node>
</launch>