This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Installation Failed | |
Boost.Python error in job "bootloader". | |
Command 'grub-install --target=x86_64-efi --efi-directory=/boot/efi --bootloader-id=Debian --force' returned non-zero exit status 1. | |
Installing for x86_64-efi platform. grub-install: warning: Cannot set EFI variable Boot0002. grub-install: warning: efivarfs_set_variable: writing to fd 7 failed: No space left on device. grub-install: warning: _efi_set_variable_mode: ops->set_variable() failed: No space left on device. grub-install: error: failed to register the EFI boot entry: No space left on device. | |
Traceback: | |
File "/usr/lib/x86_64-linux-gnu/calamares/modules/bootloader/main.py", line 444, in run | |
prepare_bootloader(fw_type) |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
ø | |
U-Boot 2019.07-rc4-00001-g607b5b738b (Jul 06 2019 - 21:01:15 -0500), Build: jenkins-github_Bootloader-Builder-127 | |
CPU : DRA752-GP ES2.0 | |
Model: BeagleBoard.org BeagleBone AI | |
Board: BeagleBone AI REV A | |
DRAM: 1 GiB | |
MMC: OMAP SD/MMC: 0, OMAP SD/MMC: 1 |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
# demo matilda | |
import os | |
import time | |
import subprocess | |
import rospy, sys | |
import moveit_commander | |
from moveit_commander import MoveGroupCommander | |
from geometry_msgs.msg import Pose | |
from copy import deepcopy | |
from transitions.extensions import MachineFactory |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
beaglebone login: debian | |
Password: | |
Last login: Tue Jan 9 20:53:34 UTC 2018 on ttyS0 | |
Linux beaglebone 4.9.74-ti-r90 #1 SMP PREEMPT Sat Jan 6 21:54:49 UTC 2018 armv7l | |
The programs included with the Debian GNU/Linux system are free software; | |
the exact distribution terms for each program are described in the | |
individual files in /usr/share/doc/*/copyright. | |
Debian GNU/Linux comes with ABSOLUTELY NO WARRANTY, to the extent |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
U-Boot SPL 2018.01-rc3-00001-gddde4ed5b3 (Jan 08 2018 - 16:12:51) | |
Trying to boot from MMC1 | |
SPL: Please implement spl_start_uboot() for your board | |
SPL: Direct Linux boot not active! | |
reading u-boot.img | |
reading u-boot.img | |
reading u-boot.img | |
reading u-boot.img |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Please rerun setup_sdcard.sh with a valid [--dtb <device>] option from the list below: | |
----------------------------- | |
# --dtb A10-OLinuXino-Lime (Olimex Ltd: A10-OLinuXino-Lime:supported) | |
# --dtb A20-OLinuXino-Lime2 (Olimex Ltd: A20-OLinuXino-Lime:supported) | |
# --dtb A20-OLinuXino-Lime (Olimex Ltd: A20-OLinuXino-Lime:supported) | |
# --dtb am43xx_evm (am437x-IDK:supported) | |
bas@debian:~/am437x_image/debian-8.9-machinekit-armhf-2017-12-04$ sudo ./setup_sdcard.sh --img debian8.9-machinekit-armhf-2017-12-04-am437xIDK --dtb am43xx-evm | |
syncing media... |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
# demo matilda talententuin | |
import os | |
import time | |
import subprocess | |
import rospy, sys | |
import moveit_commander | |
from moveit_commander import MoveGroupCommander | |
from geometry_msgs.msg import Pose | |
from copy import deepcopy | |
from transitions.extensions import MachineFactory |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
/home/bas/catkin_ws/src/trac_ik/trac_ik_lib/src/trac_ik.cpp: In constructor ‘TRAC_IK::TRAC_IK::TRAC_IK(const string&, const string&, const string&, double, double, TRAC_IK::SolveType)’: | |
/home/bas/catkin_ws/src/trac_ik/trac_ik_lib/src/trac_ik.cpp:91:70: error: no match for ‘operator=’ (operand types are ‘boost::shared_ptr<const urdf::Joint>’ and ‘urdf::JointConstSharedPtr {aka std::shared_ptr<const urdf::Joint>}’) | |
joint = robot_model.getJoint(chain_segs[i].getJoint().getName()); | |
^ | |
In file included from /usr/include/boost/shared_ptr.hpp:17:0, | |
from /usr/include/boost/date_time/time_clock.hpp:17, | |
from /usr/include/boost/thread/thread_time.hpp:9, | |
from /usr/include/boost/thread/lock_types.hpp:18, | |
from /usr/include/boost/thread/pthread/thread_data.hpp:12, | |
from /usr/include/boost/thread/thread_only.hpp:17, |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Environment set up for running Machinekit and LinuxCNC | |
Switching to UNIT 3.7 (work copy) | |
bas@mat1-j1900:~$ rostopic | |
bw echo find hz info list pub type | |
bas@mat1-j1900:~$ rostopic echo /joint_path_command | |
header: | |
seq: 2 | |
stamp: |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
machinekit@mksocfpga:~$ nm -C machinekit/rtlib/rt-preempt/hm2_pci.so | |
U __aeabi_unwind_cpp_pr0@@GCC_3.5 | |
U __aeabi_unwind_cpp_pr1@@GCC_3.5 | |
00001f84 t bitfile_do_big_chunk | |
00001eb4 t bitfile_do_small_chunk | |
0000213c t bitfile_parse_and_verify | |
00002054 t bitfile_parse_and_verify_chunk | |
00002264 t bitfile_reverse_bits | |
00015a18 b __bss_end__ | |
00015a18 b _bss_end__ |
NewerOlder