Skip to content

Instantly share code, notes, and snippets.

View davetcoleman's full-sized avatar

Dave Coleman davetcoleman

View GitHub Profile
@davetcoleman
davetcoleman / gist:6254017
Created August 16, 2013 22:27
rosnode info gazebo
--------------------------------------------------------------------------------
Node [/gazebo]
Publications:
* /rrbot/camera1/camera_info [sensor_msgs/CameraInfo]
* /rrbot/laser/scan [sensor_msgs/LaserScan]
* /rrbot/joint1_position_controller/pid/parameter_descriptions [dynamic_reconfigure/ConfigDescription]
* /rrbot/camera1/image_raw/theora/parameter_descriptions [dynamic_reconfigure/ConfigDescription]
* /rrbot/camera1/image_raw/compressed/parameter_updates [dynamic_reconfigure/Config]
* /rrbot/joint1_position_controller/state [control_msgs/JointControllerState]
* /rrbot/joint2_position_controller/state [control_msgs/JointControllerState]
@davetcoleman
davetcoleman / gist:6309167
Created August 22, 2013 15:59
Trajectory Controller Compile Errors 64bit
Building CXX object ros_controllers/joint_trajectory_controller/CMakeFiles/joint_trajectory_controller.dir/src/joint_trajectory_controller.cpp.o
[ 98%] Built target rrbot
[100%] Built target main_control
In file included from /home/dave/ros/ws_gazebo/src/ros_controllers/joint_trajectory_controller/include/joint_trajectory_controller/joint_trajectory_controller.h:73:0,
from /home/dave/ros/ws_gazebo/src/ros_controllers/joint_trajectory_controller/src/joint_trajectory_controller.cpp:34:
/home/dave/ros/ws_gazebo/src/ros_controllers/joint_trajectory_controller/include/joint_trajectory_controller/init_joint_trajectory.h: In function ‘Trajectory joint_trajectory_controller::initJointTrajectory(const JointTrajectory&, const ros::Time&, const joint_trajectory_controller::InitJointTrajectoryOptions<Trajectory>&) [with Trajectory = std::vector<joint_trajectory_controller::JointTrajectorySegment<trajectory_interface::QuinticSplineSegment<double> >, std::allocator<joint_trajectory_controller::JointTraject
@davetcoleman
davetcoleman / joint_trajectory_controller_test
Created August 23, 2013 21:18
Resutls from Hydro Precise test run
catkin_make run_tests_joint_trajectory_controller
Base path: /home/dave/ros/ws_gazebo
Source space: /home/dave/ros/ws_gazebo/src
Build space: /home/dave/ros/ws_gazebo/build
Devel space: /home/dave/ros/ws_gazebo/devel
Install space: /home/dave/ros/ws_gazebo/install
####
#### Running command: "make cmake_check_build_system" in "/home/dave/ros/ws_gazebo/build"
####
Forcing "-j1" for running unit tests.
@davetcoleman
davetcoleman / dkpg -l
Created January 23, 2014 22:34
dave computer
ii ros-hydro-actionlib 1.10.3-0precise-20140115-0412-+0000 The actionlib stack provides a standardized interface for interfacing with preemptable tasks. Examples of this include moving the base to a target location, performing a laser scan and returning the resulting point cloud, detecting the handle of a door, etc.
ii ros-hydro-actionlib-msgs 1.10.3-0precise-20140110-0833-+0000 actionlib_msgs defines the common messages to interact with an action server and an action client. For full documentation of the actionlib API see the actionlib package.
ii ros-hydro-amcl 1.11.4-2precise-20140115-0516-+0000 amcl is a probabilistic localization system for a robot moving in 2D. It implements the adaptive (or KLD-sampling) Monte Carlo localization approach (as described by Dieter Fox), which uses a particle filter to track the pose of a robot against a
<?xml version="1.0"?>
<package>
<name>rosconsole_dave_test</name>
<version>0.0.0</version>
<description>The rosconsole_dave_test package</description>
<!-- One maintainer tag required, multiple allowed, one person per tag -->
<!-- Example: -->
<!-- <maintainer email="jane.doe@example.com">Jane Doe</maintainer> -->
<maintainer email="dave@todo.todo">dave</maintainer>
@davetcoleman
davetcoleman / dave's catkin build
Created February 14, 2014 00:52
output of catkin_make_isolated --install
This file has been truncated, but you can view the full file.
ws_ros_catkin$ ./src/catkin/bin/catkin_make_isolated --install
Base path: /home/dave/ros/ws_ros_catkin
Source space: /home/dave/ros/ws_ros_catkin/src
Build space: /home/dave/ros/ws_ros_catkin/build_isolated
Devel space: /home/dave/ros/ws_ros_catkin/devel_isolated
Install space: /home/dave/ros/ws_ros_catkin/install_isolated
~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
~~ traversing 210 packages in topological order:
~~ - catkin
~~ - genmsg
@davetcoleman
davetcoleman / urdfdom files
Created February 14, 2014 01:47
tree (file system) output of src/urdfdom
tree
.
├── build
│   ├── CMakeCache.txt
│   ├── CMakeFiles
│   │   ├── CMakeCCompiler.cmake
│   │   ├── cmake.check_cache
│   │   ├── CMakeCXXCompiler.cmake
│   │   ├── CMakeDetermineCompilerABI_C.bin
│   │   ├── CMakeDetermineCompilerABI_CXX.bin
@davetcoleman
davetcoleman / Eigen
Last active August 29, 2015 13:58
Eigen Points
void simpleTest()
{
Eigen::Vector3d ballBlue, ballRed;
tf::pointMsgToEigen(pt1,ballBlue);
tf::pointMsgToEigen(pt2,ballRed);
// //Get distance between points
// Vector3 dist = ballBlue.Position - ballRed.Position;
Eigen::Vector3d dist = ballBlue - ballRed;
// dist.Normalize();
dist.normalize();
[bloom] bloom version 0.5.11
[debug] track_branches(['bloom', 'master'], None)
[debug] Tracking branches: []
[debug] Checking out to indigo-devel
[debug] Requested checkout reference is the same as the current branch
[debug] track_branches(['bloom'], None)
[debug] Tracking branches: []
[debug] Checking out to indigo-devel
[debug] Requested checkout reference is the same as the current branch
[debug] /home/dave/ros/ws_moveit_other/src/moveit_simple_grasps:$ git ls-tree bloom:CONTENT_MOVED_TO_MASTER_BRANCH
@davetcoleman
davetcoleman / gist:7dfe9a4238f38c90b631
Last active August 29, 2015 14:07
octomap_updater crash
Program received signal SIGSEGV, Segmentation fault.
[Switching to Thread 0x7fffe1222700 (LWP 18779)]
0x00007fffd1abde86 in occupancy_map_monitor::PointCloudOctomapUpdater::cloudMsgCallback (this=0xb92080, cloud_msg=...) at /home/dave/ros/ws_moveit/src/moveit_ros/perception/pointcloud_octomap_updater/src/pointcloud_octomap_updater.cpp:244
244 if (!isnan(*iter_x) && !isnan(*iter_y) && !isnan(*iter_z))
(gdb) bt
#0 0x00007fffd1abde86 in occupancy_map_monitor::PointCloudOctomapUpdater::cloudMsgCallback (this=0xb92080, cloud_msg=...) at /home/dave/ros/ws_moveit/src/moveit_ros/perception/pointcloud_octomap_updater/src/pointcloud_octomap_updater.cpp:244
#1 0x00007fffd1ae7d74 in boost::_mfi::mf1<void, occupancy_map_monitor::PointCloudOctomapUpdater, boost::shared_ptr<sensor_msgs::PointCloud2_<std::allocator<void> > const> const&>::operator() (this=0x15edc78, p=0xb92080, a1=...)
at /usr/include/boost/bind/mem_fn_template.hpp:165
#2 0x00007fffd1ae468a in boost::_bi::list2<boost::_bi::value<occupancy_map_